ardupilot/libraries
Brad Bosch f2f9349419 AP_HAL: Add support for parity to Serial passthrough
Add code to reflect USB ACM parity setting to the passthrough port alongside existing support for ACM baud rate changes.  Some use cases for serial passthrough require specific parity settings.

For example, even parity is used and required by the USART protocol used in the STM32 system bootloader. This enhancement allows the use of standard flash programming tools such as STM32CubeProgrammer to flash connected STM based peripherals such as Receivers and Telemetry radios via serial passthrough.  Some examples of such peripherals include the FrSky R9 receivers as well as various other STM based LoRa modules used by the mLRS project.
2024-06-11 09:24:32 +10:00
..
AC_AttitudeControl AC_AttitudeControl: add comments for system ID disturbance input code 2024-05-14 23:16:52 -04:00
AC_Autorotation AC_Autorotation: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AC_AutoTune AC_AutoTune: Move functions out of HAL_LOGGING_ENABLED 2024-05-29 18:29:23 +10:00
AC_Avoidance AC_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_CustomControl AC_CustomControl: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_Fence AC_Fence: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_InputManager
AC_PID AC_PID: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_PrecLand AC_PrecLand: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_Sprayer
AC_WPNav AC_WPNav: remove un-needed initialisation 2024-05-21 15:52:51 +10:00
AP_AccelCal AP_AccelCal: remove pointless assignment when counting calibrators 2024-01-21 09:53:04 +11:00
AP_ADC AP_ADC: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ADSB AP_ADSB: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Airspeed AP_Airspeed: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_AIS AP_AIS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Arming AP_Arming: exclude body of AP_Arming.cpp based on AP_ARMING_ENABLED 2024-04-17 18:17:27 +10:00
AP_Avoidance AP_Avoidance: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Baro AP_Baro: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_BattMonitor AP_BattMonitor: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Beacon AP_Beacon: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_BLHeli AP_BLHeli:expand metadata of 3d and Reverse masks 2024-06-04 09:24:41 +10:00
AP_BoardConfig AP_BoardConfig: update RTSCTS param values for new option 2024-05-28 09:48:19 +10:00
AP_Button
AP_Camera AP_Camera: move switch for sending camera messages into AP_Camera 2024-06-05 10:29:01 +10:00
AP_CANManager AP_CANManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_CheckFirmware AP_CheckFirmware: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Common AP_Common: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Compass AP_Compass: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10: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: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_DDS AP_DDS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Declination
AP_Devo_Telem
AP_DroneCAN AP_DroneCAN: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_EFI AP_EFI: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ESC_Telem AP_ESC_Telem: add support for Extended DShot Telemetry v2 2024-05-15 17:29:19 +10:00
AP_ExternalAHRS AP_ExternalAHRS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ExternalControl AP_ExternalControl: add REP-147 Global Position Control 2023-12-20 02:37:01 +00:00
AP_FETtecOneWire AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Filesystem AP_Filesystem: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: use Location.change_alt_frame for what it is good for 2024-04-14 13:29:58 +10:00
AP_Frsky_Telem AP_Frsky_Telem: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Generator AP_Generator: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_GPS AP_GPS: dynamically allocate config_GNSS 2024-06-10 06:53:23 +10:00
AP_Gripper AP_Gripper: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_GyroFFT AP_GyroFFT: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_HAL AP_HAL: Add support for parity to Serial passthrough 2024-06-11 09:24:32 +10:00
AP_HAL_ChibiOS AP_HAL: Add support for parity to Serial passthrough 2024-06-11 09:24:32 +10:00
AP_HAL_Empty HAL_Empty: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_HAL_Linux AP_HAL: Add support for parity to Serial passthrough 2024-06-11 09:24:32 +10:00
AP_HAL_SITL AP_HAL: Add support for parity to Serial passthrough 2024-06-11 09:24:32 +10:00
AP_Hott_Telem AP_Hott_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_ICEngine AP_ICEngine: correct compilation when ICEngine disabled 2024-02-20 09:16:23 +11:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor: fixed ICM42670 2024-06-07 19:44:48 +10:00
AP_InternalError AP_InternalError: fix signedness issue with snprintf 2024-05-22 23:22:23 +10:00
AP_IOMCU AP_IOMCU: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_IRLock AP_IRLock: use SocketAPM_native 2024-01-03 12:14:47 +11:00
AP_JSButton AP_JSButton: add SURFTRAK mode 2024-02-21 18:59:20 -03:00
AP_JSON AP_JSON: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_KDECAN AP_KDECAN: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_L1_Control AP_L1_Control: make AHRS attitude member variables private 2024-01-14 12:47:47 +11:00
AP_Landing AP_Landing: restart_landing_sequence get current location and pass it to get_landing_sequence_start 2024-04-02 11:11:59 +11:00
AP_LandingGear AP_LandingGear: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11: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 NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_LTM_Telem AP_LTM_Telem: add and use AP_BATTERY_ENABLED 2024-02-06 11:01:02 +11:00
AP_Math AP_Math: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Menu AP_Menu: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Mission AP_Mission: emit jump count even if no limit 2024-05-08 17:56:56 +10:00
AP_Module AP_Module: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Motors AP_Motors: fix spacing 2024-06-09 13:24:38 -04:00
AP_Mount AP_Mount: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_MSP AP_MSP: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_NavEKF AP_NavEKF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_NavEKF2 AP_NavEKF2: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_NavEKF3 AP_NavEKF3: Rework method of synthesising airspeed for dead reckoning 2024-06-09 14:25:02 +10:00
AP_Navigation
AP_Networking AP_Networking: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_NMEA_Output AP_NMEA_Output: stop passing serial manager to GPS init 2024-03-19 07:28:55 +11:00
AP_Notify AP_Notify: Convert the ENUM definition to a class 2024-06-06 15:15:14 -04:00
AP_OLC
AP_ONVIF AP_ONVIF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpenDroneID AP_OpenDroneID: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OpticalFlow AP_OpticalFlow: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OSD AP_OSD: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Parachute AP_Parachute: optional (CHUTE_OPTIONS:1) disarm defore parachute release 2024-04-10 21:55:51 +10:00
AP_Param AP_Param: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_PiccoloCAN AP_PiccoloCAN: Remove duplicated code 2024-02-25 10:19:23 +11:00
AP_Proximity AP_Proximity: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Radio AP_Radio: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Rally AP_Rally: add ASSERT_STORAGE_SIZE macro 2024-01-22 22:44:05 +11:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_RCMapper AP_RCMapper: exclude body of AP_RCMapper based on AP_RCMAPPER_ENABLED 2024-04-17 18:17:56 +10:00
AP_RCProtocol AP_RCProtocol: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_RCTelemetry AP_RCTelemetry: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Relay AP_Relay: added relay output invert function 2024-04-06 10:58:43 +11:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_RSSI
AP_RTC AP_RTC: use gmtime_r() instead of gmtime() 2024-02-21 12:09:48 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Scripting AP_Scription: added CANF logging to Halo6000 EFI driver 2024-06-09 08:37:44 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: TYPE param renamed to MAVLink 2024-05-21 08:38:59 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Soaring AP_Soaring: convert remaining uses of TRIM_ARSPD_CM to AIRSPEED_CRUISE 2024-01-23 15:00:30 +11:00
AP_Stats AP_Stats: update flight time on disarm 2024-04-05 11:31:20 +11:00
AP_SurfaceDistance AP_SurfaceDistance: Start library for tracking the floor/roof distance 2024-05-28 09:55:36 +10:00
AP_TECS AP_TECS: fixed adjusting speed without airspeed sensor 2024-03-03 20:28:38 +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: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Terrain AP_Terrain: added parameter for terrain cache size 2024-05-17 10:18:13 +10:00
AP_Torqeedo AP_Torqeedo: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Tuning AP_Tuning: allow compilation with HAL_LOGGING_ENABLED false 2024-01-17 18:25:55 +11:00
AP_Vehicle AP_Vehicle: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_VideoTX AP_VideoTX: add autobauding to Tramp 2024-05-29 17:49:08 +10:00
AP_VisualOdom AP_VisualOdom: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Winch AP_Winch: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +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: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AR_Motors AP_MotorsUGV: Fix Riscv64 compiler error issue #25974 2024-01-23 08:34:33 +09:00
AR_WPNav AR_WPNav: allow target position on track to stop advancing 2024-03-20 19:27:56 +11:00
doc treewide: fix shebangs - /bin/bash -> /usr/bin/env bash 2024-02-13 11:36:23 +11:00
Filter Filter: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
GCS_MAVLink GCS_MAVLink: move switch for sending camera messages into AP_Camera 2024-06-05 10:29:01 +10:00
PID
RC_Channel RC_Channel: detect duplicate aux functions with an ID >256 2024-05-24 09:57:17 +10:00
SITL SITL: log number of times sim paused on serial0 buffer 2024-06-11 08:51:25 +10:00
SRV_Channel SRV_Channel: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
StorageManager StorageManager: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
COLCON_IGNORE