ardupilot/libraries
BLash d4ca5fe868 AP_ExternalAHRS_VectorNav: Split IMU and EKF message
In AHRS Mode, split the single message to an IMU packet and an AHRS packet; in EKF Mode, split the two messages into an IMU message, an EKF packet, and a GNSS packet.
Simplify message header definition to consolidate and eliminate the need for static asserts
Update healthy logic and use to represent new packet structure
Replace EAH3 message with messages per-packet
Add Ypr as configured output in the EKF message
2024-07-29 15:52:29 +10:00
..
AC_AttitudeControl AC_AttitudeControl: Add Landed Gain Backoff 2024-07-25 09:50:35 +10:00
AC_AutoTune AC_Autotune: Add ABORT state for consistency between tests 2024-07-26 20:11:42 +10:00
AC_Autorotation
AC_Avoidance AC_Avoidance: correctly set back away speed for minimum alt fences 2024-07-24 08:24:06 +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: address minor review comments 2024-07-24 08:24:06 +10:00
AC_InputManager
AC_PID AC_PID: correct error caculation to use latest target 2024-07-09 11:33:03 +10:00
AC_PrecLand AC_PrecLand: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AC_Sprayer AC_Sprayer: create and use an AP_Sprayer_config.h 2024-07-05 14:27:45 +10:00
AC_WPNav AC_WPNav: correct calculation of predict-accel when zeroing pilot desired accel 2024-07-09 10:52:14 +10:00
APM_Control APM_Control: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ADC AP_ADC: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_ADSB AP_ADSB: cache course-over-ground for GPS message 2024-06-19 10:14:50 +10:00
AP_AHRS AP_AHRS: rename ins get_primary_accel to get_first_usable_accel 2024-06-26 17:12:12 +10:00
AP_AIS AP_AIS: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_AccelCal
AP_AdvancedFailsafe
AP_Airspeed AP_Airspeed: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_Arming AP_Arming: allow precise wording of fence pre-arm messages 2024-07-24 08:24:06 +10:00
AP_Avoidance AP_Avoidance: 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_Baro AP_Baro: avoid i2c errors with ICP101XX 2024-07-11 09:27:33 +10:00
AP_BattMonitor AP_BattMonitor: support I2C INA231 battery monitor 2024-07-11 09:26:17 +10:00
AP_Beacon AP_Beacon: use enum class for type 2024-06-24 18:24:11 +10:00
AP_BoardConfig AP_BoardConfig: update RTSCTS param values for new option 2024-05-28 09:48:19 +10:00
AP_Button
AP_CANManager AP_CANManager: use a switch statement to tidy driver allocation 2024-07-25 11:09:07 +10:00
AP_CSVReader
AP_Camera AP_Camera: type param desc gets topotek 2024-07-26 12:55:24 +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: fix initialization of ExpandingString so that it can be used on the stack 2024-07-24 08:24:06 +10:00
AP_Compass AP_Compass: cleanup warnings in printf calls 2024-07-11 09:34:29 +10:00
AP_CustomRotations AP_CustomRotations: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_DAL AP_DAL: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_DDS AP_DDS: add param DDS_DOMAIN_ID 2024-07-20 19:13:53 +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: DroneCAN: set the last_updated_ms field of efi_state 2024-07-14 20:19:31 +10:00
AP_ESC_Telem AP_ESC_Telem: Add ifndef before defining ESC_TELEM_MAX_ESCS 2024-07-24 17:45:24 +10:00
AP_ExternalAHRS AP_ExternalAHRS_VectorNav: Split IMU and EKF message 2024-07-29 15:52:29 +10:00
AP_ExternalControl
AP_FETtecOneWire AP_FETtecOneWire: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Filesystem AP_Filesystem: BOOL for binary types 2024-07-26 20:12:05 +10:00
AP_FlashIface
AP_FlashStorage
AP_Follow AP_Follow: factor out separate methods for handling mavlink messages 2024-06-11 16:20:20 +10:00
AP_Frsky_Telem AP_Frsky_Telem: fix for HAL_WITH_FRSKY_TELEM_BIDIRECTIONAL = 0 2024-07-26 20:12:40 +10:00
AP_GPS AP_GPS:Septentrio constellation choice 2024-07-23 10:32:32 +10:00
AP_Generator AP_Generator: avoid use of int16_t-read 2024-07-02 10:13:24 +10:00
AP_Gripper AP_Gripper: correct emitting of grabbed/released messages 2024-06-20 10:59:14 +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: adjust for renaming of Gimbal to SoloGimbal 2024-07-21 14:22:05 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: Added support for CUAV-7-Nano flight controller 2024-07-29 12:25:53 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: use correct unformatted system ID length 2024-07-17 09:08:51 +10:00
AP_HAL_Empty AP_HAL_Empty: removed run_debug_shell 2024-07-11 07:42:54 +10:00
AP_HAL_Linux HAL_Linux: removed unused I2C vector get_device 2024-07-11 11:20:47 +10:00
AP_HAL_QURT HAL_QURT: implement safety switch 2024-07-16 10:54:03 +10:00
AP_HAL_SITL AP_HAL_SITL: If HAL_CAN_WITH_SOCKETCAN is undefined, treat it as NONE 2024-07-23 10:47:16 +10:00
AP_Hott_Telem
AP_ICEngine
AP_IOMCU AP_IOMCU: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: Check the gyro/accel id has not been previously registered 2024-07-25 09:49:35 +10:00
AP_InternalError AP_InternalError: fix signedness issue with snprintf 2024-05-22 23:22:23 +10:00
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: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_L1_Control
AP_LTM_Telem AP_LTM_Telem: correct compilation with AP_RRSI_ENABLED false 2024-07-24 09:11:39 +10:00
AP_Landing
AP_LandingGear
AP_LeakDetector AP_LeakDetector: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Logger AP_Logger: add events for all fence types 2024-07-24 08:24:06 +10:00
AP_MSP AP_MSP: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Math AP_Math: updated EulerAngles.pdf link 2024-07-27 11:14:10 +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: add and use an option_is_set method 2024-07-29 10:37:52 +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: Clean up spacing 2024-07-02 08:39:33 +09:00
AP_Mount AP_Mount: allow AP_MOUNT_BACKEND_DEFAULT_ENABLED to be overridden 2024-07-28 12:00:02 +10:00
AP_NMEA_Output
AP_NavEKF AP_NavEKF: option to align extnav to optflow pos estimate 2024-07-09 11:59:36 +10:00
AP_NavEKF2 AP_NavEKF2: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +10:00
AP_NavEKF3 AP_NavEKF3: Fix yaw alignment bug 2024-07-25 09:34:48 +10:00
AP_Navigation
AP_Networking AP_Networking: add debug code for PPP 2024-07-25 09:37:16 +10:00
AP_Notify AP_Notify: Perform common checks first 2024-07-25 09:50:03 +10:00
AP_OLC
AP_ONVIF AP_ONVIF: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_OSD AP_OSD: correct compilation with AP_RRSI_ENABLED false 2024-07-24 09:11:39 +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: cleanup printf warnings 2024-07-11 09:34:29 +10:00
AP_Parachute
AP_Param AP_Param: added get_eeprom_full() 2024-06-18 10:29:55 +10:00
AP_PiccoloCAN
AP_Proximity AP_Proximity: avoid use of int16_t-read call 2024-07-10 17:01:09 +10:00
AP_RAMTRON
AP_RCMapper
AP_RCProtocol AP_RCProtocol: remove redundant check for crsf telem on iomcu 2024-06-26 18:13:01 +10:00
AP_RCTelemetry AP_RCTelemetry: use get_max_rpm_esc() 2024-06-26 17:36:54 +10:00
AP_ROMFS AP_ROMFS: clarify usage and null termination 2024-05-04 10:15:44 +10:00
AP_RPM AP_RPM: Improve rpm logging 2024-07-10 12:24:15 +10:00
AP_RSSI AP_RSSI: make metadata more consistent 2024-07-02 11:34:29 +10:00
AP_RTC
AP_Radio AP_Radio: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Rally
AP_RangeFinder AP_Rangefinder: cleanup printf warnings 2024-07-11 09:34:29 +10:00
AP_Relay
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Scripting AP_Scripting: dynamically load some binding objects 2024-07-23 10:34:52 +10:00
AP_SerialLED
AP_SerialManager AP_SerialManager: remove Volz port config 2024-07-11 13:07:24 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: add point made public 2024-07-24 17:22:44 +10:00
AP_Soaring
AP_Stats
AP_SurfaceDistance AP_SurfaceDistance: Start library for tracking the floor/roof distance 2024-05-28 09:55:36 +10:00
AP_TECS AP_TECS: Converted parameter TKOFF_MODE to TKOFF_OPTIONS 2024-07-29 15:50:32 +10:00
AP_TempCalibration AP_TempCalibration: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: Extend analog sensor backend to 5th order polynomial 2024-07-24 17:53:08 +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_Vehicle AP_TECS: Converted parameter TKOFF_MODE to TKOFF_OPTIONS 2024-07-29 15:50:32 +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_Volz_Protocol: move output to thread 2024-07-11 13:07:24 +10:00
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
AR_Motors AR_Motors: add frame type Omni3Mecanum 2024-07-16 16:28:06 +09:00
AR_WPNav
Filter Filter: add "source" to option 5 2024-07-24 17:20:30 +10:00
GCS_MAVLink GCS_MAVLink: use bitmask based enablement for fences 2024-07-24 08:24:06 +10:00
PID
RC_Channel ArduCopter/RC_Channel: add option 219 2024-07-25 09:40:13 +10:00
SITL SITL: integrate SlungPayload 2024-07-24 17:09:06 +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
doc
COLCON_IGNORE