Ardupilot2/libraries
Michael du Breuil bbcc31ecec AP_RCProtocol: Refactor SUMD to remove legacy cruft
Of particular note this removes the partial SUMH support. This has been
broken as far back as 2018, as we only called add_input() if we were in
the SUMD or SUMD failsafe cases, which meant SUMH didn't work. This
commits to that path, and removes all the 8 bit CRC, SUMH support.

This also refactors a number of things for readability (condensing white
space, simplifying guards around debug code). Many of the debugs could
probably be removed, but this simplifies it.

This was tested against the RCProtocol example test, and everything
there reports a pass.
2023-06-27 10:57:06 +10:00
..
AC_AttitudeControl AC_AttitudeControl: allow AP_SCRIPTING_ENABLED to come from hwdef files 2023-06-09 16:10:52 +10:00
AC_Autorotation
AC_AutoTune AC_AutoTune: correct incorrect min raw rate valuee 2023-06-26 09:56:30 +10:00
AC_Avoidance AC_Avoidance: make _output_level AP_Enum 2023-05-15 09:25:57 +10:00
AC_CustomControl AC_CustomControl_PID: set false to avoid hitting limits 2023-06-20 10:50:11 +10:00
AC_Fence
AC_InputManager
AC_PID
AC_PrecLand AC_PrecLand: fixes for feature disablement 2023-04-05 18:33:19 +10:00
AC_Sprayer
AC_WPNav AP_Mount: Support for pointing mount to circle center 2023-05-08 10:48:20 +10:00
AP_AccelCal
AP_ADC
AP_ADSB AP_ADSB: fix SageTech MXS climbRate sign 2023-06-06 20:09:28 +10:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: add and use AP_AHRS_ENABLED 2023-06-21 22:28:48 +10:00
AP_Airspeed AP_Airspeed: correct includes 2023-05-09 10:56:13 +10:00
AP_AIS
AP_Arming AP_Arming: reword GPS pre-arm failure 2023-06-21 14:11:14 +10:00
AP_Avoidance
AP_Baro AP_Baro: add and use AP_BARO_ENABLED 2023-06-21 22:28:48 +10:00
AP_BattMonitor AP_BattMonitor: create and use AP_BATTERY_ENABLED 2023-06-21 22:28:48 +10:00
AP_Beacon
AP_BLHeli
AP_BoardConfig AP_BoardConfig: fixed documentation of safety options 2023-05-26 17:45:32 +10:00
AP_Button
AP_Camera AP_Camera: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_CANManager AP_CANManager: correct gate on definition of AP_CANManager class 2023-04-20 08:53:46 +10:00
AP_CheckFirmware
AP_Common AP_Common: Remove type punning utils to AP_Math 2023-06-05 09:09:13 +10:00
AP_Compass AP_Compass: stop auto replacing missing CAN by default, add option to re-enable 2023-06-27 09:24:41 +10:00
AP_CSVReader
AP_CustomRotations
AP_DAL AP_DAL: Add handlers for external lat lng position set 2023-06-06 15:19:12 +10:00
AP_DDS AP_DDS: Update docs for supported topics 2023-06-16 22:39:26 +10:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: set priority and timeout for RGB LEDs 2023-06-24 20:48:08 +10:00
AP_EFI AP_EFI: allow AP_SCRIPTING_ENABLED to come from hwdef files 2023-06-09 16:10:52 +10:00
AP_ESC_Telem AP_ESC_Telem: Raise default timeout for the RPM spin check to 210ms 2023-06-20 09:30:03 +10:00
AP_ExternalAHRS AP_ExternalAHRS: Use sparse-endian be32to<ftype>_ptr 2023-06-05 09:09:13 +10:00
AP_FETtecOneWire AP_FETtecOneWire: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_Filesystem AP_Filesystem: correct include problem 2023-06-18 10:35:27 +10:00
AP_FlashIface AP_FlashIface: support OctoSPI flash correctly 2023-04-28 08:31:15 +10:00
AP_FlashStorage AP_FlashStorage: port for STM32L4+ processor 2023-04-14 07:48:56 +10:00
AP_Follow AP_Follow: support for Mount following the lead vehicle in follow mode 2023-05-26 11:10:35 -07:00
AP_Frsky_Telem
AP_Generator AP_Generator: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_GPS AP_GPS: ensure uart buffer sizes are OK for RTK 2023-06-27 10:32:43 +10:00
AP_Gripper AP_Gripper: text messages and more defines 2023-04-11 10:31:31 +10:00
AP_GyroFFT
AP_HAL AP_HAL: add dshot commands and ESC types for extended dshot telemetry (EDT) 2023-06-27 09:28:33 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add and use AP_SCHEDULER_EXTENDED_TASKINFO_ENABLED 2023-06-27 10:43:39 +10:00
AP_HAL_Empty AP_HAL_Empty: rename QSPIDevice to WSPIDevice 2023-04-28 08:31:15 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: new board: esp32s3devkit 2023-05-26 10:54:01 -07:00
AP_HAL_Linux AP_HAL_Linux: fix help ouput from Options to Examples 2023-06-17 17:51:34 +10:00
AP_HAL_SITL HAL_SITL: fixed multicast UDP on cygwin 2023-06-26 15:49:02 +10:00
AP_Hott_Telem
AP_ICEngine AP_ICEngine: allow for ICE with no RPM support 2023-05-30 07:29:55 +10:00
AP_InertialNav AP_InertialNav: clarify get_vert_pos_rate AHRS method name to include 'D' 2023-06-06 20:09:28 +10:00
AP_InertialSensor AP_InertialSensor: create define specifically for the developer feature for killing IMUs 2023-06-07 18:23:01 +10:00
AP_InternalError AP_InternalError: imu resets aren't fatal on esp32 2023-05-02 14:38:03 +10:00
AP_IOMCU AP_IOMCU: remove intermediate option_is_enabled methods for RC_Channel 2023-06-14 17:39:43 +10:00
AP_IRLock
AP_JSButton AP_JSButton: add unittest 2023-06-07 17:16:15 +10:00
AP_KDECAN AP_KDECAN: move and rename CAN Driver_Type enumeration 2023-04-20 08:53:46 +10:00
AP_L1_Control
AP_Landing
AP_LandingGear
AP_LeakDetector
AP_Logger AP_Logger: remove requirement to know storage type of fence item in headers 2023-06-24 14:21:01 +10:00
AP_LTM_Telem AP_LTM_Telem: use minimize_features.inc for more features 2023-06-06 10:14:02 +10:00
AP_Math AP_Math: add alternate implementation of parity for AP_Periph 2023-06-07 21:41:14 +10:00
AP_Menu
AP_Mission AP_Mission: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_Module
AP_Motors AP_Motors: Add motor test checks method to refuse test 2023-06-27 10:24:15 +10:00
AP_Mount AP_Mount: Siyi displays camera fw ver 2023-06-16 14:30:46 +10:00
AP_MSP AP_MSP: use minimize.inc for HAL_MSP_ENABLED and dependencies 2023-06-14 17:44:13 +10:00
AP_NavEKF AP_NavEKF: ensure gyro biases are numbers 2023-03-21 12:18:33 +11:00
AP_NavEKF2 AP_NavEKF2: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_NavEKF3 AP_NavEKF3: fixed velocity reset on AID_NONE 2023-06-26 18:09:31 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: add and use AP_AHRS_ENABLED 2023-06-21 22:28:48 +10:00
AP_Notify AP_Notify: fixed DroneCAN LEDs 2023-06-24 20:48:08 +10:00
AP_OLC AP_OLC: move OSD minimised features to minimize_features.inc 2023-02-28 10:40:27 +11:00
AP_ONVIF
AP_OpenDroneID AP_OpenDroneID: remove Chip ID as Basic ID mechanism 2023-06-17 14:49:22 +10:00
AP_OpticalFlow AP_OpticalFlow: use minimize.inc for HAL_MSP_ENABLED and dependencies 2023-06-14 17:44:13 +10:00
AP_OSD AP_OSD: correct checks for HAL_WITH_MSP_DISPLAYPORT 2023-06-14 17:44:13 +10:00
AP_Parachute AP_Parachute: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_Param AP_Param: allow AP_SCRIPTING_ENABLED to come from hwdef files 2023-06-09 16:10:52 +10:00
AP_PiccoloCAN AP_PiccoloCAN: remove double-definition of HAL_PICCOLOCAN_ENABLED 2023-06-09 08:00:46 +10:00
AP_Proximity AP_Proximity: RPLidarA2 gets S1 support 2023-05-16 10:15:23 +10:00
AP_Radio AP_Radio: correct build of AP_Radio_bk2425 2023-04-14 20:10:11 +10:00
AP_Rally
AP_RAMTRON AP_RAMTRON: added PB85RS128C and PB85RS2MC 2023-03-19 17:22:53 +11:00
AP_RangeFinder AP_RangeFinder: use minimize.inc for HAL_MSP_ENABLED and dependencies 2023-06-14 17:44:13 +10:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: Refactor SUMD to remove legacy cruft 2023-06-27 10:57:06 +10:00
AP_RCTelemetry AP_RCTelemetry: remove intermediate option_is_enabled methods for RC_Channel 2023-06-14 17:39:43 +10:00
AP_Relay AP_Relay: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_RobotisServo AP_RobotisServo: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_ROMFS
AP_RPM AP_RPM: remove unused 2023-06-14 17:58:43 +10:00
AP_RSSI
AP_RTC
AP_SBusOut AP_SBusOut: add and use AP_SBUSOUTPUT_ENABLED 2023-06-27 10:10:41 +10:00
AP_Scheduler AP_Scheduler: add and use AP_SCHEDULER_EXTENDED_TASKINFO_ENABLED 2023-06-27 10:43:39 +10:00
AP_Scripting AP_Scripting: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_SerialLED AP_SerialLED: add defines for some AP_Notify LED libraries 2023-03-07 10:30:13 +11:00
AP_SerialManager AP_SerialManager: improve OPTIONS desc for Swap bit 2023-05-17 17:34:10 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AP_SmartRTL
AP_Soaring
AP_Stats
AP_TECS AP_TECS: correct metadata for FLARE_HGT 2023-04-11 08:54:45 +10:00
AP_TempCalibration
AP_TemperatureSensor AP_TemperatureSensor: create and use AP_BATTERY_ENABLED 2023-06-21 22:28:48 +10:00
AP_Terrain AP_Terrain: replace HAVE_FILESYSTEM_SUPPORT with backend defines 2023-05-17 09:40:39 +10:00
AP_Torqeedo AP_Torqeedo: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_Tuning
AP_Vehicle AP_Vehicle: initialise generator before init_ardupilot 2023-06-27 09:54:29 +10:00
AP_VideoTX
AP_VisualOdom AP_VisualOdom: allow VisualOdom backends to be compiled in individually 2023-04-15 22:19:21 +10:00
AP_Volz_Protocol AP_Volz_Protocol: don't check MINIMIZE_FEATURES when also checking BOARD_FLASH_SIZE 2023-04-15 09:33:35 +10:00
AP_WheelEncoder
AP_Winch AP_Winch: Fix baud rate handling 2023-03-04 07:59:23 +09:00
AP_WindVane AP_WindVane: Enable SITL when it is selected 2023-06-17 14:48:49 +10:00
APM_Control AR_PosControl: add input_pos_vel_accel target 2023-05-30 10:17:13 +10:00
AR_Motors AR_Motors: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
AR_WPNav
doc
Filter Filter: Examples: Add Transfer function check and MATLAB 2023-05-23 10:31:13 +10:00
GCS_MAVLink GCS_MAVLink: added mutex deadlock test code 2023-06-27 10:11:46 +10:00
PID
RC_Channel RC_Channel: add option to disable relay and servorelay libraries 2023-06-20 09:36:39 +10:00
SITL SITL: use SIM_config for ship and adsb simulations 2023-06-17 17:57:15 +10:00
SRV_Channel SRV_Channel: add and use AP_SBUSOUTPUT_ENABLED 2023-06-27 10:10:41 +10:00
StorageManager StorageManager: fixed startup crash 2023-03-12 07:15:01 +11:00
COLCON_IGNORE Tools: add COLCON_IGNORE to modules and libraries 2023-04-19 18:34:15 +10:00