ardupilot/libraries
Peter Barker 6bf29eca70 AP_AIS: remove incorrect use of strncat
the third argument is space remaining in buffer, not size of buffer...

../../libraries/AP_AIS/AP_AIS.cpp:183:71: warning: Potential buffer overflow. Replace with 'sizeof(multi) - strlen(multi) - 1' or use a safer 'strlcat' API [unix.cstring.BadSizeArg]
                    strncat(multi,_AIVDM_buffer[msg_parts[i]].payload,sizeof(multi));
                                                                      ^~~~~~~~~~~~~
../../libraries/AP_AIS/AP_AIS.cpp:185:49: warning: Potential buffer overflow. Replace with 'sizeof(multi) - strlen(multi) - 1' or use a safer 'strlcat' API [unix.cstring.BadSizeArg]
                strncat(multi,_incoming.payload,sizeof(multi));
2025-01-31 15:52:50 +11:00
..
AC_AttitudeControl AC_PosControl: add get_vel_target and get_accel_target 2024-12-18 18:28:12 +11:00
AC_Autorotation AC_Autorotation: Mode restructure and speed controller improvement 2025-01-22 18:53:44 +11:00
AC_AutoTune AC_AutoTune_Heli: fix rate and accel limiting 2025-01-06 16:23:37 -05:00
AC_Avoidance AC_Avoidance: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AC_CustomControl AC_CustomControl: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
AC_Fence AC_Fence: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AC_InputManager
AC_PID AC_PID: AC_P_2D comment fix 2024-10-04 09:25:56 +09:00
AC_PrecLand AC_PrecLand: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AC_Sprayer AC_Sprayer: create and use an AP_Sprayer_config.h 2024-07-05 14:27:45 +10:00
AC_WPNav AC_Loiter: updates to offset handling 2024-10-04 09:25:56 +09:00
AP_AccelCal
AP_ADC AP_ADC: remove variable dead stores 2025-01-30 08:47:34 +11:00
AP_ADSB AP_ADSB: add option to force Mode3AC Only 2024-12-14 22:51:11 -08:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: fix singleton panic message 2024-12-15 23:38:24 +11:00
AP_AHRS AP_AHRS: remove changes to primary accel since it is always the same as the gyro 2025-01-29 18:47:51 +11:00
AP_Airspeed AP_Airspeed: Fix spelling in GCS message 2025-01-05 17:43:49 +00:00
AP_AIS AP_AIS: remove incorrect use of strncat 2025-01-31 15:52:50 +11:00
AP_Arming AP_Arming: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_Avoidance AP_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Baro AP_Baro: optimize DroneCAN subscription process 2024-11-18 10:30:29 +11:00
AP_BattMonitor AP_BattMonitor: document BATTn_OPTIONS bit 8 (internal-use-only) 2025-01-06 22:12:53 +11:00
AP_Beacon AP_Beacon: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_BLHeli AP_BLHeli: use native motor numbering 2025-01-14 11:24:52 +11:00
AP_BoardConfig AP_BoardConfig: support flow control on UARTs 6->8 2025-01-28 12:01:45 +11:00
AP_Button AP_Button: set source index when running aux functions 2024-12-24 11:34:07 +11:00
AP_Camera AP_Camera: use get_stick_gesture_pos() for RunCam menus 2025-01-15 18:28:44 +11:00
AP_CANManager AP_CANManager: alphabetise protocol param values 2025-01-15 14:54:14 +09:00
AP_CheckFirmware AP_CheckFirmware: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Common AP_Common: Add cont array constructor to AP_Bitmask 2025-01-08 08:52:21 +11:00
AP_Compass AP_Compass: make compass LearnType enum-class and parameter AP_Enum 2025-01-29 19:21:59 +11:00
AP_CSVReader
AP_CustomRotations AP_CustomRotations: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_DAL AP_DAL: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_DDS AP_DDS: Sync README with Wiki 2025-01-28 17:02:41 +11:00
AP_Declination
AP_Devo_Telem AP_Devo_Telem: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_DroneCAN AP_DroneCAN: don't delcare xacti publishers if xacti not compiled in 2025-01-20 21:54:29 +11:00
AP_EFI AP_EFI: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_ESC_Telem AP_ESC_Telem: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_ExternalAHRS AP_ExternalAHRS: support backends with get_variances() 2024-10-23 06:46:59 +09:00
AP_ExternalControl AP_ExternalControl: arm through external control 2024-11-17 21:05:59 +11:00
AP_FETtecOneWire AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Filesystem AP_Filesystem: allow for logical blocks bigger than physical blocks in littlefs. 2025-01-21 11:10:31 +11:00
AP_FlashIface
AP_FlashStorage AP_FlashStorage: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_Follow AP_Follow: use set_alt_m when possible 2024-11-08 10:54:39 +11:00
AP_Frsky_Telem AP_Frsky_Telem: remove dead variable write 2025-01-29 21:41:51 +11:00
AP_Generator AP_Generator: apply -Os to all cpp files 2024-12-17 11:11:27 +11:00
AP_GPS AP_GPS: refactor GSOF to expect packets by ID 2025-01-08 08:52:21 +11:00
AP_Gripper AP_Gripper: correct emitting of grabbed/released messages 2024-06-20 10:59:14 +10:00
AP_GSOF AP_GSOF: refactor GSOF to expect packets by ID 2025-01-08 08:52:21 +11:00
AP_GyroFFT AP_GyroFFT: move to new constant dt low pass filter class 2024-08-20 09:09:41 +10:00
AP_HAL AP_HAL: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_HAL_Empty AP_HAL_Empty: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_HAL_ESP32 AP_HAL_ESP32: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_HAL_Linux AP_HAL_Linux: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_HAL_QURT AP_HAL_QURT: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_HAL_SITL AP_HAL_SITL: add get_device_ptr to HAL I2CDevice API 2025-01-31 09:19:33 +11:00
AP_Hott_Telem AP_Hott_Telem: disable Hott telemetry by default 2024-08-06 09:30:49 +10:00
AP_IBus_Telem AP_IBus_Telem: Initial implementation 2024-08-07 14:01:44 +10:00
AP_ICEngine AP_ICEngine: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_InertialNav AP_InertialNav: remove use of AP_AHRS from most headers 2024-09-03 10:35:54 +10:00
AP_InertialSensor AP_InertialSensor: remove changes to primary accel since it is always the same as the gyro 2025-01-29 18:47:51 +11:00
AP_InternalError AP_InternalError: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_IOMCU AP_IOMCU: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_IRLock
AP_JSButton
AP_JSON AP_JSON: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_KDECAN AP_KDECAN: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_L1_Control AP_L1_Control: Fix NAVL1_PERIOD description typo 2025-01-30 20:53:17 +11:00
AP_Landing AP_Landing: mode AUTOLAND enhancements 2025-01-21 11:30:23 +11:00
AP_LandingGear AP_LandingGear: use GCS_SEND_TEXT rather than gcs().send_text 2024-08-07 18:33:16 +10:00
AP_LeakDetector AP_LeakDetector: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Logger AP_Logger: use GCS_SEND_TEXT for error message rather than stdout 2025-01-31 08:32:29 +11:00
AP_LTM_Telem AP_LTM_Telem: disable LTM telemetry by default 2024-08-06 09:30:49 +10:00
AP_Math AP_Math: correct description of linear_interpolate 2025-01-11 11:24:36 +11:00
AP_Menu AP_Menu: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Mission AP_Mission: don't update _last_change_time_ms for write of home 2025-01-28 10:30:06 +11:00
AP_Module AP_Module: remove use of AP_AHRS from most headers 2024-09-03 10:35:54 +10:00
AP_Motors AP_Motors: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_Mount AP_Mount: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_MSP AP_MSP: MSP_RAW_GPS cog should be decidegrees not centidegrees 2024-09-13 12:45:22 +10:00
AP_MultiHeap AP_MultiHeap: initialize only if heap allocation succeeded 2025-01-05 10:27:32 +11:00
AP_NavEKF AP_NavEKF3: move definition of MAX_EKF_CORES 2024-12-31 10:55:51 +11:00
AP_NavEKF2 AP_NavEKF2: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_NavEKF3 AP_NavEKF3: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_Navigation
AP_Networking AP_Networking: correct closing comment on #if 2025-01-07 12:39:42 +11:00
AP_NMEA_Output
AP_Notify AP_Notify: avoid use of OwnPtr for ToshibaLED 2025-01-31 09:19:33 +11:00
AP_OLC
AP_ONVIF AP_ONVIF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpenDroneID Copter: Give better error in opendroneid build when DID_ENABLE=0. 2024-09-17 09:17:24 +10:00
AP_OpticalFlow AP_OpticalFlow: alphabetise type param values 2025-01-15 14:54:14 +09:00
AP_OSD AP_OSD: use get_stick_gesture_pos() for OSD menus 2025-01-15 18:28:44 +11:00
AP_Parachute AP_Parachute: remove AUX_FUNC entries based on feature defines 2024-09-08 00:55:43 +10:00
AP_Param AP_Param: add a set_and_save method to AP_Enum 2025-01-29 19:21:59 +11:00
AP_PiccoloCAN AP_PiccoloCAN: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_Proximity AP_Proximity: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_Quicktune AP_Quicktune: adjust defaults 2024-11-27 14:07:38 +11:00
AP_Radio AP_Radio: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_Rally
AP_RAMTRON
AP_RangeFinder Replay: add example script for converting from cm to m in RRNI and RRNH messages 2025-01-21 10:54:05 +11:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: remove superfluous linefeed from panic strings 2024-12-14 10:06:13 +11:00
AP_RCTelemetry AP_RCTelemetry: add missing CRSF scheduler table entry 2024-12-05 10:03:27 -06:00
AP_Relay AP_Relay: adjust for new type-safety for AP_Enum 2025-01-29 19:21:59 +11:00
AP_RobotisServo AP_RobotisServo: Send register write values as little-endian 2024-09-27 11:53:06 +10:00
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: save some flash when features disabled 2025-01-14 11:46:13 +11:00
AP_RSSI AP_RSSI: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_RTC AP_RTC: correct logger documentation 2024-11-22 10:18:31 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: log RTC into PM message 2024-11-21 09:19:38 +11:00
AP_Scripting AP_Scripting: use AP_PERIPH_BARO_ENABLED in place of HAL_PERIPH_ENABLE_BRO 2025-01-31 08:25:28 +11:00
AP_SerialLED AP_SerialLED: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_SerialManager AP_SerialManager: add i-BUS Telemetry protocol param desc 2025-01-22 17:22:55 +11:00
AP_Servo_Telem AP_Servo_Telem: rearrange log-structure ifdefs 2025-01-14 11:46:13 +11:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: add point made public 2024-07-24 17:22:44 +10:00
AP_Soaring AP_Soaring: Rate limit the NVF publishers to 4Hz 2025-01-28 17:22:28 +11:00
AP_Stats
AP_SurfaceDistance AP_SurfaceDistance: allow for more than 327m range rangefinders 2025-01-21 10:54:05 +11:00
AP_TECS AP_TECS: Removed an unused variable to get rid of a compiler warning 2024-12-14 15:42:46 +11:00
AP_TempCalibration AP_TempCalibration: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: optimize DroneCAN subscription process 2024-11-18 10:30:29 +11:00
AP_Terrain AP_Terrain: Add const to locals 2024-11-26 15:42:04 +11:00
AP_Torqeedo AP_Torqeedo: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AP_Tuning AP_Tuning: Bugfix 2025-01-21 11:19:37 +11:00
AP_Vehicle AP_Vehicle: treat goal publisher relying on get_target_location as external control 2025-01-15 12:27:43 +11:00
AP_VideoTX AP_VideoTX: Change division to multiplication 2025-01-02 23:22:42 +11:00
AP_VisualOdom AP_VisualOdom: fix singleton panic message 2024-12-15 23:38:24 +11:00
AP_Volz_Protocol AP_Volz_Protocol: servo telem rename valid_types to present_types 2025-01-14 10:49:31 +11:00
AP_WheelEncoder AP_WheelEncoder: correct initialisation of WheelRateController objects 2024-09-24 10:46:34 +09:00
AP_Winch AP_Winch: correct compilation when backends compiled out 2024-08-12 18:28:27 +10:00
AP_WindVane AP_WindVane: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
APM_Control APM_Control: Correct use of deceleration 2024-11-04 11:55:28 +09:00
AR_Motors AR_Motors: rename SRV_Channel::Aux_servo_function_t to SRV_Channel::Function 2025-01-28 21:56:46 +11:00
AR_WPNav AR_WPNav: re-order initialiser lines so -Werror=reorder will work 2024-09-24 22:50:28 +10:00
doc
Filter Filter: Make heli default mode for harmonic notch tracking = fixed 2025-01-21 11:22:36 +11:00
GCS_MAVLink GCS_MAVLink: correct resetting of parity after passthhru is done 2025-01-29 21:45:37 +11:00
PID
RC_Channel RC_Channel: make compass LearnType enum-class and parameter AP_Enum 2025-01-29 19:21:59 +11:00
SITL SITL: remove variable dead stores 2025-01-30 08:47:34 +11:00
SRV_Channel SRV_Channel: remove buggy, unused method 2025-01-29 19:21:59 +11:00
StorageManager StorageManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
COLCON_IGNORE