Skip to content

Commit

Permalink
remove not needed whitespaces
Browse files Browse the repository at this point in the history
  • Loading branch information
wind0r committed Aug 24, 2017
1 parent dfe868e commit 03aa31a
Show file tree
Hide file tree
Showing 197 changed files with 118 additions and 308 deletions.
2 changes: 1 addition & 1 deletion .github/issue_template.md
Original file line number Diff line number Diff line change
Expand Up @@ -7,5 +7,5 @@
2.) Include ways to reproduce the problem;
3.) Provide information about your flightcontroller and other components including how they are connected/wired;
4.) Add the used configuration and firmware version;
5.) Create a `diff` and post it here in a code block. Put \`\`\` (three backticks) at the start and end of the `diff` block; and
5.) Create a `diff` and post it here in a code block. Put \`\`\` (three backticks) at the start and end of the `diff` block; and
6.) Remove this Text :).
4 changes: 2 additions & 2 deletions .travis.sh
Original file line number Diff line number Diff line change
Expand Up @@ -67,7 +67,7 @@ elif [ $TARGET ] ; then

elif [ $GOAL ] ; then
$MAKE $GOAL || exit $?

if [ $PUBLISHCOV ] ; then
if [ "test" == "$GOAL" ] ; then
lcov --directory . -b src/test --capture --output-file coverage.info 2>&1 | grep -E ":version '402\*', prefer.*'406\*" --invert-match
Expand All @@ -76,6 +76,6 @@ elif [ $GOAL ] ; then
coveralls-lcov coverage.info # uploads to coveralls
fi
fi
else
else
$MAKE all
fi
4 changes: 2 additions & 2 deletions .travis.yml
Original file line number Diff line number Diff line change
Expand Up @@ -54,11 +54,11 @@ before_script:

script: ./.travis.sh

cache:
cache:
directories:
- downloads
- tools


#notifications:
# irc: "chat.freenode.net#cleanflight"
Expand Down
2 changes: 0 additions & 2 deletions CONTRIBUTING.md
Original file line number Diff line number Diff line change
Expand Up @@ -11,5 +11,3 @@ Please search for existing issues *before* creating new ones.
# Developers

Please refer to the development section in the `docs/development` folder.


2 changes: 1 addition & 1 deletion Makefile
Original file line number Diff line number Diff line change
Expand Up @@ -106,7 +106,7 @@ FATFS_SRC = $(notdir $(wildcard $(FATFS_DIR)/*.c))

CSOURCES := $(shell find $(SRC_DIR) -name '*.c')

LD_FLAGS :=
LD_FLAGS :=

#
# Default Tool options - can be overridden in {mcu}.mk files.
Expand Down
8 changes: 4 additions & 4 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -27,7 +27,7 @@ Betaflight has the following features:

## Installation & Documentation

See: https://github.com/betaflight/betaflight/wiki
See: https://github.com/betaflight/betaflight/wiki

## IRC Support and Developers Channel

Expand Down Expand Up @@ -89,18 +89,18 @@ Origins for this fork (Thanks!):
* **Dominic Clifton** (for Cleanflight), and
* **Sambas** (for the original STM32F4 port).

The Betaflight Configurator is forked from Cleanflight Configurator and its origins.
The Betaflight Configurator is forked from Cleanflight Configurator and its origins.

Origins for Betaflight Configurator:
* **Dominic Clifton** (for Cleanflight configurator), and
* **ctn** (for the original Configurator).
* **ctn** (for the original Configurator).

Big thanks to current and past contributors:
* Budden, Martin (martinbudden)
* Bardwell, Joshua (joshuabardwell)
* Blackman, Jason (blckmn)
* ctzsnooze
* Höglund, Anders (andershoglund)
* Höglund, Anders (andershoglund)
* Ledvin, Peter (ledvinap) - **IO code awesomeness!**
* kc10kevin
* Keeble, Gary (MadmanK)
Expand Down
1 change: 0 additions & 1 deletion make/build_verbosity.mk
Original file line number Diff line number Diff line change
Expand Up @@ -19,4 +19,3 @@ export V0 :=
export V1 :=
export STDOUT :=
endif

2 changes: 1 addition & 1 deletion make/mcu/SITL.mk
Original file line number Diff line number Diff line change
Expand Up @@ -66,4 +66,4 @@ OPTIMISE_SPEED := -Ofast
OPTIMISE_SIZE := -Os

LTO_FLAGS := $(OPTIMISATION_BASE) $(OPTIMISE_SPEED)
endif
endif
6 changes: 3 additions & 3 deletions make/mcu/STM32F1.mk
Original file line number Diff line number Diff line change
Expand Up @@ -69,12 +69,12 @@ MCU_COMMON_SRC = \
drivers/system_stm32f10x.c \
drivers/timer_stm32f10x.c

DSP_LIB :=
DSP_LIB :=

ifneq ($(DEBUG),GDB)
OPTIMISE_DEFAULT := -Os
OPTIMISE_SPEED :=
OPTIMISE_SIZE :=
OPTIMISE_SPEED :=
OPTIMISE_SIZE :=

LTO_FLAGS := $(OPTIMISATION_BASE) $(OPTIMISE_DEFAULT)
endif
4 changes: 2 additions & 2 deletions make/mcu/STM32F4.mk
Original file line number Diff line number Diff line change
Expand Up @@ -17,7 +17,7 @@ ifeq ($(PERIPH_DRIVER), HAL)
CMSIS_DIR := $(ROOT)/lib/main/STM32F4/Drivers/CMSIS
STDPERIPH_DIR = $(ROOT)/lib/main/STM32F4/Drivers/STM32F4xx_HAL_Driver
STDPERIPH_SRC = $(notdir $(wildcard $(STDPERIPH_DIR)/Src/*.c))
EXCLUDES =
EXCLUDES =
else
CMSIS_DIR := $(ROOT)/lib/main/CMSIS/CM4
STDPERIPH_DIR = $(ROOT)/lib/main/STM32F4/Drivers/STM32F4xx_StdPeriph_Driver
Expand Down Expand Up @@ -102,7 +102,7 @@ VPATH := $(VPATH):$(CMSIS_DIR)/CoreSupport:$(CMSIS_DIR)/DeviceSupport/
VPATH := $(VPATH):$(CMSIS_DIR)/Core:$(CMSIS_DIR)/Device/ST/STM32F4xx

ifeq ($(PERIPH_DRIVER), HAL)
CMSIS_SRC :=
CMSIS_SRC :=
INCLUDE_DIRS := $(INCLUDE_DIRS) \
$(STDPERIPH_DIR)/Inc \
$(USBCORE_DIR)/Inc \
Expand Down
4 changes: 2 additions & 2 deletions make/mcu/STM32F7.mk
Original file line number Diff line number Diff line change
Expand Up @@ -94,7 +94,7 @@ DEVICE_STDPERIPH_SRC := $(STDPERIPH_SRC) \
#CMSIS
VPATH := $(VPATH):$(CMSIS_DIR)/Include:$(CMSIS_DIR)/Device/ST/STM32F7xx
VPATH := $(VPATH):$(STDPERIPH_DIR)/Src
CMSIS_SRC :=
CMSIS_SRC :=
INCLUDE_DIRS := $(INCLUDE_DIRS) \
$(STDPERIPH_DIR)/Inc \
$(USBCORE_DIR)/Inc \
Expand All @@ -114,7 +114,7 @@ ARCH_FLAGS = -mthumb -mcpu=cortex-m7 -mfloat-abi=hard -mfpu=fpv5-sp-d16 -fs

DEVICE_FLAGS = -DUSE_HAL_DRIVER -DUSE_FULL_LL_DRIVER
ifeq ($(TARGET),$(filter $(TARGET),$(F7X5XG_TARGETS)))
DEVICE_FLAGS += -DSTM32F745xx
DEVICE_FLAGS += -DSTM32F745xx
LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f745.ld
STARTUP_SRC = startup_stm32f745xx.s
TARGET_FLASH := 2048
Expand Down
1 change: 0 additions & 1 deletion make/openocd.mk
Original file line number Diff line number Diff line change
Expand Up @@ -15,4 +15,3 @@ endif
ifneq ($(OPENOCD_CFG),)
OPENOCD_COMMAND = $(OPENOCD) -f $(OPENOCD_IF) -f $(OPENOCD_CFG)
endif

2 changes: 1 addition & 1 deletion make/source.mk
Original file line number Diff line number Diff line change
Expand Up @@ -167,7 +167,7 @@ FC_SRC = \
io/vtx_smartaudio.c \
io/vtx_tramp.c \
io/vtx_control.c

COMMON_DEVICE_SRC = \
$(CMSIS_SRC) \
$(DEVICE_STDPERIPH_SRC)
Expand Down
1 change: 0 additions & 1 deletion make/tools.mk
Original file line number Diff line number Diff line change
Expand Up @@ -344,4 +344,3 @@ breakpad_clean:
$(V1) [ ! -d "$(BREAKPAD_DIR)" ] || $(RM) -rf $(BREAKPAD_DIR)
$(V0) @echo " CLEAN $(BREAKPAD_DL_FILE)"
$(V1) $(RM) -f $(BREAKPAD_DL_FILE)

1 change: 0 additions & 1 deletion src/main/build/build_config.h
Original file line number Diff line number Diff line change
Expand Up @@ -38,4 +38,3 @@
#define REQUIRE_CC_ARM_PRINTF_SUPPORT
#define REQUIRE_PRINTF_LONG_SUPPORT
#endif

1 change: 0 additions & 1 deletion src/main/cms/cms.h
Original file line number Diff line number Diff line change
Expand Up @@ -25,4 +25,3 @@ void cmsUpdate(uint32_t currentTimeUs);
#define CMS_EXIT (0)
#define CMS_EXIT_SAVE (1)
#define CMS_EXIT_SAVEREBOOT (2)

1 change: 0 additions & 1 deletion src/main/cms/cms_menu_vtx_rtc6705.c
Original file line number Diff line number Diff line change
Expand Up @@ -100,4 +100,3 @@ CMS_Menu cmsx_menuVtxRTC6705 = {
};

#endif // CMS

1 change: 0 additions & 1 deletion src/main/common/bitarray.c
Original file line number Diff line number Diff line change
Expand Up @@ -36,4 +36,3 @@ void bitArrayClr(void *array, unsigned bit)
{
BITARRAY_BIT_OP((uint32_t*)array, bit, &=~);
}

1 change: 0 additions & 1 deletion src/main/common/colorconversion.c
Original file line number Diff line number Diff line change
Expand Up @@ -81,4 +81,3 @@ rgbColor24bpp_t* hsvToRgb24(const hsvColor_t* c)
}
return &r;
}

1 change: 0 additions & 1 deletion src/main/common/filter.c
Original file line number Diff line number Diff line change
Expand Up @@ -286,4 +286,3 @@ float firFilterDenoiseUpdate(firFilterDenoise_t *filter, float input)
else
return filter->movingSum / ++filter->filledCount + 1;
}

1 change: 0 additions & 1 deletion src/main/common/filter.h
Original file line number Diff line number Diff line change
Expand Up @@ -98,4 +98,3 @@ float firFilterLastInput(const firFilter_t *filter);

void firFilterDenoiseInit(firFilterDenoise_t *filter, uint8_t gyroSoftLpfHz, uint16_t targetLooptime);
float firFilterDenoiseUpdate(firFilterDenoise_t *filter, float input);

1 change: 0 additions & 1 deletion src/main/common/huffman_table.c
Original file line number Diff line number Diff line change
Expand Up @@ -282,4 +282,3 @@ const huffmanTable_t huffmanTable[HUFFMAN_TABLE_SIZE] = {
{ 9, 0x2800 }, // 0xFF 001010000
{ 12, 0x0000 }, // EOF 000000000000
};

1 change: 0 additions & 1 deletion src/main/common/typeconversion.c
Original file line number Diff line number Diff line change
Expand Up @@ -282,4 +282,3 @@ float fastA2F(const char *p)
// Return signed and scaled floating point result.
return sign * (frac ? (value / scale) : (value * scale));
}

1 change: 0 additions & 1 deletion src/main/config/config_unittest.h
Original file line number Diff line number Diff line change
Expand Up @@ -95,4 +95,3 @@ int32_t unittest_pidMultiWiiRewrite_DTerm[3];

#endif // UNIT_TEST
#endif // SRC_MAIN_FLIGHT_PID_C_

1 change: 0 additions & 1 deletion src/main/config/parameter_group_ids.h
Original file line number Diff line number Diff line change
Expand Up @@ -125,4 +125,3 @@
#define PG_RESERVED_FOR_TESTING_1 4095
#define PG_RESERVED_FOR_TESTING_2 4094
#define PG_RESERVED_FOR_TESTING_3 4093

10 changes: 0 additions & 10 deletions src/main/drivers/accgyro/accMpu6000.cpp

This file was deleted.

1 change: 0 additions & 1 deletion src/main/drivers/accgyro/accgyro_fake.c
Original file line number Diff line number Diff line change
Expand Up @@ -151,4 +151,3 @@ bool fakeAccDetect(accDev_t *acc)
return true;
}
#endif // USE_FAKE_ACC

1 change: 0 additions & 1 deletion src/main/drivers/accgyro/accgyro_lsm303dlhc.h
Original file line number Diff line number Diff line change
Expand Up @@ -439,4 +439,3 @@ typedef struct {


bool lsm303dlhcAccDetect(accDev_t *acc);

1 change: 0 additions & 1 deletion src/main/drivers/adc_stm32f30x.c
Original file line number Diff line number Diff line change
Expand Up @@ -236,4 +236,3 @@ void adcInit(const adcConfig_t *config)

ADC_StartConversion(adc.ADCx);
}

1 change: 0 additions & 1 deletion src/main/drivers/barometer/barometer_bmp280.h
Original file line number Diff line number Diff line change
Expand Up @@ -57,4 +57,3 @@
// 10/16 = 0.625 ms

bool bmp280Detect(baroDev_t *baro);

1 change: 0 additions & 1 deletion src/main/drivers/barometer/barometer_fake.c
Original file line number Diff line number Diff line change
Expand Up @@ -70,4 +70,3 @@ bool fakeBaroDetect(baroDev_t *baro)
return true;
}
#endif // USE_FAKE_BARO

1 change: 0 additions & 1 deletion src/main/drivers/barometer/barometer_fake.h
Original file line number Diff line number Diff line change
Expand Up @@ -20,4 +20,3 @@
struct baroDev_s;
bool fakeBaroDetect(struct baroDev_s *baro);
void fakeBaroSet(int32_t pressure, int32_t temperature);

1 change: 0 additions & 1 deletion src/main/drivers/bus.h
Original file line number Diff line number Diff line change
Expand Up @@ -50,4 +50,3 @@ void targetBusInit(void);
bool busWriteRegister(const busDevice_t *bus, uint8_t reg, uint8_t data);
bool busReadRegisterBuffer(const busDevice_t *bus, uint8_t reg, uint8_t *data, uint8_t length);
uint8_t busReadRegister(const busDevice_t *bus, uint8_t reg);

1 change: 0 additions & 1 deletion src/main/drivers/bus_i2c_soft.c
Original file line number Diff line number Diff line change
Expand Up @@ -264,4 +264,3 @@ uint16_t i2cGetErrorCounter(void)
}

#endif

1 change: 0 additions & 1 deletion src/main/drivers/bus_spi_impl.h
Original file line number Diff line number Diff line change
Expand Up @@ -70,4 +70,3 @@ typedef struct SPIDevice_s {
} spiDevice_t;

extern spiDevice_t spiDevice[SPIDEV_COUNT];

1 change: 0 additions & 1 deletion src/main/drivers/compass/compass_fake.c
Original file line number Diff line number Diff line change
Expand Up @@ -63,4 +63,3 @@ bool fakeMagDetect(magDev_t *mag)
return true;
}
#endif // USE_FAKE_MAG

1 change: 0 additions & 1 deletion src/main/drivers/display.c
Original file line number Diff line number Diff line change
Expand Up @@ -115,4 +115,3 @@ void displayInit(displayPort_t *instance, const displayPortVTable_t *vTable)
instance->grabCount = 0;
instance->cursorRow = -1;
}

2 changes: 1 addition & 1 deletion src/main/drivers/dma_stm32f7xx.c
Original file line number Diff line number Diff line change
Expand Up @@ -115,4 +115,4 @@ dmaIdentifier_e dmaGetIdentifier(const DMA_Stream_TypeDef* stream)
}
}
return 0;
}
}
1 change: 0 additions & 1 deletion src/main/drivers/io_def.h
Original file line number Diff line number Diff line change
Expand Up @@ -49,4 +49,3 @@
#include "target.h"
// include template-generated macros for IO pins
#include "io_def_generated.h"

1 change: 0 additions & 1 deletion src/main/drivers/io_def_generated.h
Original file line number Diff line number Diff line change
Expand Up @@ -1160,4 +1160,3 @@
# define DEFIO_PORT_USED_LIST /* empty */
# define DEFIO_PORT_OFFSET_LIST /* empty */
#endif

1 change: 0 additions & 1 deletion src/main/drivers/rcc.h
Original file line number Diff line number Diff line change
Expand Up @@ -18,4 +18,3 @@ enum rcc_reg {

void RCC_ClockCmd(rccPeriphTag_t periphTag, FunctionalState NewState);
void RCC_ResetCmd(rccPeriphTag_t periphTag, FunctionalState NewState);

1 change: 0 additions & 1 deletion src/main/drivers/rcc_types.h
Original file line number Diff line number Diff line change
@@ -1,4 +1,3 @@
#pragma once

typedef uint8_t rccPeriphTag_t;

1 change: 0 additions & 1 deletion src/main/drivers/resource.c
Original file line number Diff line number Diff line change
Expand Up @@ -67,4 +67,3 @@ const char * const ownerNames[OWNER_TOTAL_COUNT] = {
"ESCSERIAL",
"CAMERA_CONTROL",
};

1 change: 0 additions & 1 deletion src/main/drivers/rx_nrf24l01.h
Original file line number Diff line number Diff line change
Expand Up @@ -198,4 +198,3 @@ void NRF24L01_SetTxMode(void);
void NRF24L01_ClearAllInterrupts(void);
void NRF24L01_SetChannel(uint8_t channel);
bool NRF24L01_ReadPayloadIfAvailable(uint8_t *data, uint8_t length);

1 change: 0 additions & 1 deletion src/main/drivers/rx_spi.c
Original file line number Diff line number Diff line change
Expand Up @@ -144,4 +144,3 @@ uint8_t rxSpiReadCommandMulti(uint8_t command, uint8_t commandData, uint8_t *ret
return ret;
}
#endif

1 change: 0 additions & 1 deletion src/main/drivers/rx_spi.h
Original file line number Diff line number Diff line change
Expand Up @@ -32,4 +32,3 @@ uint8_t rxSpiWriteCommand(uint8_t command, uint8_t data);
uint8_t rxSpiWriteCommandMulti(uint8_t command, const uint8_t *data, uint8_t length);
uint8_t rxSpiReadCommand(uint8_t command, uint8_t commandData);
uint8_t rxSpiReadCommandMulti(uint8_t command, uint8_t commandData, uint8_t *retData, uint8_t length);

1 change: 0 additions & 1 deletion src/main/drivers/rx_xn297.c
Original file line number Diff line number Diff line change
Expand Up @@ -87,4 +87,3 @@ uint8_t XN297_WritePayload(uint8_t *data, int len, const uint8_t *rxAddr)
packet[RX_TX_ADDR_LEN + len + 1] = crc & 0xff;
return NRF24L01_WritePayload(packet, RX_TX_ADDR_LEN + len + 2);
}

1 change: 0 additions & 1 deletion src/main/drivers/rx_xn297.h
Original file line number Diff line number Diff line change
Expand Up @@ -22,4 +22,3 @@

uint16_t XN297_UnscramblePayload(uint8_t* data, int len, const uint8_t *rxAddr);
uint8_t XN297_WritePayload(uint8_t *data, int len, const uint8_t *rxAddr);

1 change: 0 additions & 1 deletion src/main/drivers/serial_softserial.h
Original file line number Diff line number Diff line change
Expand Up @@ -33,4 +33,3 @@ uint32_t softSerialTxBytesFree(const serialPort_t *instance);
uint8_t softSerialReadByte(serialPort_t *instance);
void softSerialSetBaudRate(serialPort_t *s, uint32_t baudRate);
bool isSoftSerialTransmitBufferEmpty(const serialPort_t *s);

1 change: 0 additions & 1 deletion src/main/drivers/serial_tcp.h
Original file line number Diff line number Diff line change
Expand Up @@ -47,4 +47,3 @@ void tcpDataOut(tcpPort_t *instance);
bool tcpIsStart(void);
bool* tcpGetUsed(void);
tcpPort_t* tcpGetPool(void);

1 change: 0 additions & 1 deletion src/main/drivers/sound_beeper.h
Original file line number Diff line number Diff line change
Expand Up @@ -39,4 +39,3 @@ typedef struct beeperDevConfig_s {
void systemBeep(bool on);
void systemBeepToggle(void);
void beeperInit(const beeperDevConfig_t *beeperDevConfig);

1 change: 0 additions & 1 deletion src/main/fc/fc_msp_box.h
Original file line number Diff line number Diff line change
Expand Up @@ -36,4 +36,3 @@ void serializeBoxPermanentIdFn(struct sbuf_s *dst, const box_t *box);
typedef void serializeBoxFn(struct sbuf_s *dst, const box_t *box);
void serializeBoxReply(struct sbuf_s *dst, int page, serializeBoxFn *serializeBox);
void initActiveBoxIds(void);

3 changes: 0 additions & 3 deletions src/main/fc/settings.h
Original file line number Diff line number Diff line change
Expand Up @@ -145,6 +145,3 @@ extern const char * const lookupTableBaroHardware[];

extern const char * const lookupTableMagHardware[];
//extern const uint8_t lookupTableMagHardwareEntryCount;



4 changes: 0 additions & 4 deletions src/main/flight/failsafe.h
Original file line number Diff line number Diff line change
Expand Up @@ -89,7 +89,3 @@ void failsafeOnRxResume(void);

void failsafeOnValidDataReceived(void);
void failsafeOnValidDataFailed(void);




1 change: 0 additions & 1 deletion src/main/flight/imu.c
Original file line number Diff line number Diff line change
Expand Up @@ -528,4 +528,3 @@ void imuSetHasNewData(uint32_t dt)
IMU_UNLOCK;
}
#endif

2 changes: 0 additions & 2 deletions src/main/flight/imu.h
Original file line number Diff line number Diff line change
Expand Up @@ -80,5 +80,3 @@ void imuSetAttitudeQuat(float w, float x, float y, float z);
void imuSetHasNewData(uint32_t dt);
#endif
#endif


1 change: 0 additions & 1 deletion src/main/io/serial_4way_impl.h
Original file line number Diff line number Diff line change
Expand Up @@ -45,4 +45,3 @@ typedef struct ioMem_s {
uint8_t D_FLASH_ADDR_L;
uint8_t *D_PTR_I;
} ioMem_t;

Loading

0 comments on commit 03aa31a

Please sign in to comment.