Skip to content

Commit

Permalink
Add missing newline at the end of files
Browse files Browse the repository at this point in the history
  • Loading branch information
MaEtUgR authored and dagar committed Dec 1, 2023
1 parent 4c0b6db commit 1c25d65
Show file tree
Hide file tree
Showing 113 changed files with 113 additions and 113 deletions.
2 changes: 1 addition & 1 deletion src/drivers/adc/ads1115/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -38,4 +38,4 @@ px4_add_module(
ads1115_main.cpp
ADS1115.cpp
DEPENDS
)
)
2 changes: 1 addition & 1 deletion src/drivers/adc/board_adc/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_ADC_BOARD_ADC
bool "board_adc"
default n
---help---
Enable support for board_adc
Enable support for board_adc
2 changes: 1 addition & 1 deletion src/drivers/barometer/bmp280/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_BMP280
bool "bmp280"
default n
---help---
Enable support for bmp280
Enable support for bmp280
2 changes: 1 addition & 1 deletion src/drivers/barometer/bmp388/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_BMP388
bool "bmp388"
default n
---help---
Enable support for bmp388
Enable support for bmp388
2 changes: 1 addition & 1 deletion src/drivers/barometer/dps310/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_DPS310
bool "dps310"
default n
---help---
Enable support for dps310
Enable support for dps310
2 changes: 1 addition & 1 deletion src/drivers/barometer/lps22hb/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_LPS22HB
bool "lps22hb"
default n
---help---
Enable support for lps22hb
Enable support for lps22hb
2 changes: 1 addition & 1 deletion src/drivers/barometer/lps25h/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_LPS25H
bool "lps25h"
default n
---help---
Enable support for lps25h
Enable support for lps25h
2 changes: 1 addition & 1 deletion src/drivers/barometer/lps33hw/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_LPS33HW
bool "lps33hw"
default n
---help---
Enable support for lps33hw
Enable support for lps33hw
2 changes: 1 addition & 1 deletion src/drivers/barometer/mpl3115a2/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_MPL3115A2
bool "mpl3115a2"
default n
---help---
Enable support for mpl3115a2
Enable support for mpl3115a2
2 changes: 1 addition & 1 deletion src/drivers/barometer/ms5611/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_MS5611
bool "ms5611"
default n
---help---
Enable support for ms5611
Enable support for ms5611
2 changes: 1 addition & 1 deletion src/drivers/barometer/tcbp001ta/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BAROMETER_TCBP001TA
bool "tcbp001ta"
default n
---help---
Enable support for tcbp001ta
Enable support for tcbp001ta
2 changes: 1 addition & 1 deletion src/drivers/batt_smbus/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BATT_SMBUS
bool "batt_smbus"
default n
---help---
Enable support for batt_smbus
Enable support for batt_smbus
2 changes: 1 addition & 1 deletion src/drivers/bootloaders/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_BOOTLOADERS
bool "bootloaders"
default n
---help---
Enable support for bootloaders
Enable support for bootloaders
2 changes: 1 addition & 1 deletion src/drivers/camera_capture/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_CAMERA_CAPTURE
bool "camera_capture"
default n
---help---
Enable support for camera_capture
Enable support for camera_capture
2 changes: 1 addition & 1 deletion src/drivers/camera_capture/camera_capture_params.c
Original file line number Diff line number Diff line change
Expand Up @@ -84,4 +84,4 @@ PARAM_DEFINE_INT32(CAM_CAP_MODE, 0);
* @group Camera Control
* @reboot_required true
*/
PARAM_DEFINE_INT32(CAM_CAP_EDGE, 0);
PARAM_DEFINE_INT32(CAM_CAP_EDGE, 0);
2 changes: 1 addition & 1 deletion src/drivers/camera_trigger/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_CAMERA_TRIGGER
bool "camera_trigger"
default n
---help---
Enable support for camera_trigger
Enable support for camera_trigger
2 changes: 1 addition & 1 deletion src/drivers/differential_pressure/ets/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DIFFERENTIAL_PRESSURE_ETS
bool "ets"
default n
---help---
Enable support for ets
Enable support for ets
2 changes: 1 addition & 1 deletion src/drivers/differential_pressure/sdp3x/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DIFFERENTIAL_PRESSURE_SDP3X
bool "sdp3x"
default n
---help---
Enable support for sdp3x
Enable support for sdp3x
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/cm8jl65/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_CM8JL65
bool "cm8jl65"
default n
---help---
Enable support for cm8jl65
Enable support for cm8jl65
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/leddar_one/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_LEDDAR_ONE
bool "leddar_one"
default n
---help---
Enable support for leddar_one
Enable support for leddar_one
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/lightware_laser_i2c/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_LIGHTWARE_LASER_I2C
bool "lightware_laser_i2c"
default n
---help---
Enable support for lightware_laser_i2c
Enable support for lightware_laser_i2c
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/lightware_laser_serial/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_LIGHTWARE_LASER_SERIAL
bool "lightware_laser_serial"
default n
---help---
Enable support for lightware_laser_serial
Enable support for lightware_laser_serial
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/ll40ls/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_LL40LS
bool "ll40ls"
default n
---help---
Enable support for ll40ls
Enable support for ll40ls
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/ll40ls_pwm/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_LL40LS_PWM
bool "ll40ls_pwm"
default n
---help---
Enable support for ll40ls_pwm
Enable support for ll40ls_pwm
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/mappydot/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_MAPPYDOT
bool "mappydot"
default n
---help---
Enable support for mappydot
Enable support for mappydot
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/mappydot/parameters.c
Original file line number Diff line number Diff line change
Expand Up @@ -294,4 +294,4 @@ PARAM_DEFINE_INT32(SENS_MPDT10_ROT, 0);
* @value 6 Yaw 270°
* @value 7 Yaw 315°
*/
PARAM_DEFINE_INT32(SENS_MPDT11_ROT, 0);
PARAM_DEFINE_INT32(SENS_MPDT11_ROT, 0);
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/mb12xx/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_MB12XX
bool "mb12xx"
default n
---help---
Enable support for mb12xx
Enable support for mb12xx
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/mb12xx/parameters.c
Original file line number Diff line number Diff line change
Expand Up @@ -291,4 +291,4 @@ PARAM_DEFINE_INT32(SENS_MB12_10_ROT, 0);
* @value 6 Yaw 270°
* @value 7 Yaw 315°
*/
PARAM_DEFINE_INT32(SENS_MB12_11_ROT, 0);
PARAM_DEFINE_INT32(SENS_MB12_11_ROT, 0);
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/pga460/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_PGA460
bool "pga460"
default n
---help---
Enable support for pga460
Enable support for pga460
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/srf02/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_SRF02
bool "srf02"
default n
---help---
Enable support for srf02
Enable support for srf02
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/srf05/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_SRF05
bool "srf05"
default n
---help---
Enable support for srf05
Enable support for srf05
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/teraranger/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_TERARANGER
bool "teraranger"
default n
---help---
Enable support for teraranger
Enable support for teraranger
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/tfmini/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_TFMINI
bool "tfmini"
default n
---help---
Enable support for tfmini
Enable support for tfmini
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/ulanding_radar/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_ULANDING_RADAR
bool "ulanding_radar"
default n
---help---
Enable support for ulanding_radar
Enable support for ulanding_radar
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/vl53l0x/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_VL53L0X
bool "vl53l0x"
default n
---help---
Enable support for vl53l0x
Enable support for vl53l0x
2 changes: 1 addition & 1 deletion src/drivers/distance_sensor/vl53l1x/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DISTANCE_SENSOR_VL53L1X
bool "vl53l1x"
default n
---help---
Enable support for vl53l1x
Enable support for vl53l1x
2 changes: 1 addition & 1 deletion src/drivers/dshot/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_DSHOT
bool "dshot"
default n
---help---
Enable support for dshot
Enable support for dshot
2 changes: 1 addition & 1 deletion src/drivers/heater/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_HEATER
bool "heater"
default n
---help---
Enable support for heater
Enable support for heater
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm20602/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM20602
bool "icm20602"
default n
---help---
Enable support for icm20602
Enable support for icm20602
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm20649/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM20649
bool "icm20649"
default n
---help---
Enable support for icm20649
Enable support for icm20649
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm20689/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM20689
bool "icm20689"
default n
---help---
Enable support for icm20689
Enable support for icm20689
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm20948/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM20948
bool "icm20948"
default n
---help---
Enable support for icm20948
Enable support for icm20948
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm40609d/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM40609D
bool "icm40609d"
default n
---help---
Enable support for icm40609d
Enable support for icm40609d
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm42605/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM42605
bool "icm42605"
default n
---help---
Enable support for icm42605
Enable support for icm42605
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm42688p/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM42688P
bool "icm42688p"
default n
---help---
Enable support for icm42688p
Enable support for icm42688p
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/icm45686/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_ICM45686
bool "icm45686"
default n
---help---
Enable support for icm45686
Enable support for icm45686
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/mpu6000/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_MPU6000
bool "mpu6000"
default n
---help---
Enable support for mpu6000
Enable support for mpu6000
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/mpu6500/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_MPU6500
bool "mpu6500"
default n
---help---
Enable support for mpu6500
Enable support for mpu6500
2 changes: 1 addition & 1 deletion src/drivers/imu/invensense/mpu9250/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IMU_INVENSENSE_MPU9250
bool "mpu9250"
default n
---help---
Enable support for mpu9250
Enable support for mpu9250
2 changes: 1 addition & 1 deletion src/drivers/ins/vectornav/libvnc/include/vn/enum.h
Original file line number Diff line number Diff line change
Expand Up @@ -667,4 +667,4 @@ typedef enum
VNPROCESSOR_IMU /**< IMU Processor. */
} VnProcessorType;

#endif
#endif
2 changes: 1 addition & 1 deletion src/drivers/irlock/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_IRLOCK
bool "irlock"
default n
---help---
Enable support for irlock
Enable support for irlock
2 changes: 1 addition & 1 deletion src/drivers/lights/neopixel/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_LIGHTS_NEOPIXEL
bool "neopixel"
default n
---help---
Enable support for neopixel
Enable support for neopixel
2 changes: 1 addition & 1 deletion src/drivers/lights/rgbled/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_LIGHTS_RGBLED
bool "rgbled"
default n
---help---
Enable support for rgbled
Enable support for rgbled
2 changes: 1 addition & 1 deletion src/drivers/lights/rgbled_is31fl3195/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_LIGHTS_RGBLED_IS31FL3195
bool "rgbled is31fl3195"
default n
---help---
Enable support for rgbled IS3FL3195 driver
Enable support for rgbled IS3FL3195 driver
2 changes: 1 addition & 1 deletion src/drivers/lights/rgbled_ncp5623c/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_LIGHTS_RGBLED_NCP5623C
bool "rgbled_ncp5623c"
default n
---help---
Enable support for rgbled_ncp5623c
Enable support for rgbled_ncp5623c
2 changes: 1 addition & 1 deletion src/drivers/lights/rgbled_pwm/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_LIGHTS_RGBLED_PWM
bool "rgbled_pwm"
default n
---help---
Enable support for rgbled_pwm
Enable support for rgbled_pwm
2 changes: 1 addition & 1 deletion src/drivers/linux_pwm_out/Kconfig
Original file line number Diff line number Diff line change
Expand Up @@ -2,4 +2,4 @@ menuconfig DRIVERS_LINUX_PWM_OUT
bool "linux_pwm_out"
default n
---help---
Enable support for linux_pwm_out
Enable support for linux_pwm_out
Loading

0 comments on commit 1c25d65

Please sign in to comment.