ardupilot/libraries
Andrew Tridgell 12721f37b7 AP_OpenDroneID: set EMERGENCY status on crash or chute deploy
RemoteID modules are required to set EMERGENCY status on uncontrolled
descent or crash. This fixes our implementation to do that, either via
existing vehicle crash checking code or via a parachute release
2023-02-11 09:42:55 +09:00
..
AC_AttitudeControl AC_AttitudeControl: add get_rate_ef_targets accessor 2023-02-11 09:42:55 +09:00
AC_Autorotation AC_Autorotation: params always use set method 2022-08-03 13:43:48 +01:00
AC_AutoTune AC_AutoTune: fix pilot testing bug 2022-12-10 10:34:44 +09:00
AC_Avoidance AC_Avoidance: check for alloc failure of ObjectBuffer 2023-01-10 08:12:47 +09:00
AC_CustomControl AC_CustomControl: add README 2022-08-30 13:10:09 +10:00
AC_Fence AC_Fence: always clear breaches 2022-09-12 08:57:42 +09:00
AC_InputManager AC_InputManager: params always use set method 2022-08-03 13:43:48 +01:00
AC_PID AC_PID: Support changing update period 2023-01-10 08:12:47 +09:00
AC_PrecLand PrecLand: support LANDING_TARGET ext field 2022-09-06 12:10:21 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: remove _wp_accel_cmss.set_and_save_ifchanged 2023-01-10 08:12:47 +09:00
AP_AccelCal AP_AccelCal: limit COMMAND_ACKs accepted for vehicle pose confirmation 2022-05-25 17:55:55 +10:00
AP_ADC AP_ADC: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ADSB AP_ADSB: correct metadata in libraries failing checks on emitter 2022-08-16 11:50:11 +10:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: add note to desc's on how to determine GPIO pin numbers 2022-04-24 08:21:01 +09:00
AP_AHRS AP_AHRS: pre-arm msg loses extra AHRS prefix 2022-11-21 18:48:35 +09:00
AP_Airspeed AP_Airspeed: add instance to hygrometer logging 2022-11-21 18:48:35 +09:00
AP_AIS AP_AIS: include GCS_MAVLink.h 2022-07-13 18:32:35 +10:00
AP_Arming AP_Arming: correct prefix is ahrs is waiting for home 2023-01-10 08:12:47 +09:00
AP_Avoidance AP_Avoidance: params always use set method 2022-08-03 13:43:48 +01:00
AP_Baro AP_Baro: BMP390 2022-11-21 18:48:35 +09:00
AP_BattMonitor AP_BattMonitor: move read_block up to SMBus base class 2022-08-30 09:09:54 +10:00
AP_Beacon AP_Beacon: params always use set method 2022-08-03 13:43:48 +01:00
AP_BLHeli AP_BLHeli: make ESC debug easier to see 2022-08-03 17:06:38 +10:00
AP_BoardConfig AP_BoardConfig: fixed description of BRD_IO_ENABLE 2022-11-21 18:48:35 +09:00
AP_Button AP_Button: pre-arm displays gpio vs servo_ch conflict 2022-04-26 15:19:28 +09:00
AP_Camera AP_Camera: fixed CAM_MIN_INTERVAL 2022-12-10 10:34:44 +09:00
AP_CANManager AP_CANManager: disable SLCAN when armed 2022-10-04 16:50:08 +09:00
AP_CheckFirmware AP_CheckFirmware: rename secure data to apsec_data 2022-09-05 12:35:37 +10:00
AP_Common AP_Common: added setonoff() method for bitmask 2022-10-24 22:23:32 +09:00
AP_Compass AP_Compass: fixed zero compass diagonals 2023-02-11 09:42:55 +09:00
AP_CustomRotations AP_CustomRotations: fix param refrencing 2022-04-20 18:25:57 +10:00
AP_DAL AP_DAL: added set source events for EKF3 2022-05-31 09:17:37 +10:00
AP_Declination AP_Declination: avoid undefined floating point exceptions on macOS when using implicit casts 2022-08-24 17:34:17 +10:00
AP_Devo_Telem AP_Devo_Telem: rename AP_AHRS::get_position to get_location 2022-01-25 10:47:22 +11:00
AP_EFI AP_EFI: fixed units of exhaust gas temperature 2022-11-21 18:48:35 +09:00
AP_ESC_Telem AP_ESC_TELEM: allow for non-continguous ESC telem motor sets 2022-10-24 22:23:32 +09:00
AP_ExternalAHRS AP_ExternalAHRS: fixes from --ubsan autotest 2022-09-06 10:49:50 +10:00
AP_FETtecOneWire AP_FETTecOneWire: Fix the recent change of NUM_SERVO_CHANNELS > 24 2022-06-22 11:51:23 +10:00
AP_Filesystem AP_Filesystem: rename HAL_MISSION_ENABLED to AP_MISSION_ENABLED 2022-08-18 22:49:10 +10:00
AP_FlashIface AP_FlashIface: fix examples 2022-08-19 18:33:58 +10:00
AP_FlashStorage
AP_Follow AP_Follow: vector params always use set method 2022-08-03 13:43:48 +01:00
AP_Frsky_Telem AP_Frsky_Telem: fixes from --ubsan autotest 2022-09-06 10:49:50 +10:00
AP_Generator AP_Generator: add AP_GENERATOR_RICHENPOWER_ENABLED 2022-07-19 09:09:05 +10:00
AP_GPS AP_GPS: improve support for uBlox-M10 2022-12-10 10:34:44 +09:00
AP_Gripper AP_Gripper: apply auto close to all backends. 2022-08-09 13:23:35 +10:00
AP_GyroFFT AP_GyroFFT: correct ref_energy indexing that could lead to free memory read 2022-10-04 16:50:08 +09:00
AP_HAL AP_HAL: add UART baudrate accessor 2023-01-10 08:12:47 +09:00
AP_HAL_ChibiOS hwdef: save flash to get 4.3.3 building on some low flash boards 2023-01-10 08:12:47 +09:00
AP_HAL_Empty AP_HAL_Empty: move implementations of functions to header 2022-06-23 12:38:41 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: increase short board names to 23 chars 2022-10-04 16:50:08 +09:00
AP_HAL_Linux AP_HAL_Linux: check for alloc failure of ObjectBuffer 2023-01-10 08:12:47 +09:00
AP_HAL_SITL HAL_SITL: use motor mask for noise checking for motors 2022-10-24 22:23:32 +09:00
AP_Hott_Telem AP_Hott_Telem: Console output can be disabled 2022-05-17 09:53:06 +10:00
AP_ICEngine AP_ICEngine: report when engine goes into run state 2022-10-14 17:13:10 +09:00
AP_InertialNav AP_InertialNav: nfc, fix to say relative to EKF origin 2022-02-03 12:05:12 +09:00
AP_InertialSensor AP_InertialSensor: cleanup NAMED_VALUE_FLOAT for fifo error 2023-01-20 09:58:14 +09:00
AP_InternalError
AP_IOMCU AP_IOMCU: log number of errors reading status page 2022-09-02 11:16:52 +10:00
AP_IRLock AP_IRLock: correct spelling mili -> milli 2022-01-31 08:55:29 +09:00
AP_JSButton
AP_KDECAN AP_KDECAN: more changes for 32 bit servo mask 2022-05-22 12:07:37 +10:00
AP_L1_Control AP_L1_Control: use AP_GROUPINFO instead of AP_GROUPINFO_FRAME 2022-05-10 09:35:11 +10:00
AP_Landing AP_Landing: prevent a landing division by zero 2022-12-23 09:43:42 +09:00
AP_LandingGear AP_LandingGear: SITL: only set defualts is SITL pin is set avoiding enable via param conversion 2022-08-02 10:48:19 +10:00
AP_LeakDetector
AP_Logger AP_Logger: PM msg gets LR field 2022-12-10 10:34:44 +09:00
AP_LTM_Telem AP_LTM_Telem: add AP_LTM_TELEM_ENABLED 2022-06-28 20:19:41 +10:00
AP_Math AP_Math: extend the control.cpp test suite 2023-01-10 08:12:47 +09:00
AP_Menu
AP_Mission AP_Mission: initialize jump-tracking in init() 2022-10-04 16:50:08 +09:00
AP_Module AP_Module: correct ModuleTest example for lack of GCS object 2022-08-19 18:34:19 +10:00
AP_Motors AP_Motors: Support changing update period 2023-01-10 08:12:47 +09:00
AP_Mount AP_Mount: servo driver loses unnecessary closest_limits method 2023-01-10 08:12:47 +09:00
AP_MSP AP_MSP: move arming status to MSP telemetry base class 2022-10-04 16:50:08 +09:00
AP_NavEKF AP_NavEKF: added a getter function for active source set 2022-08-18 02:05:27 -04:00
AP_NavEKF2 AP_NavEKF2: stop using GCS_MAVLINK.h in header files 2022-08-16 09:45:51 +10:00
AP_NavEKF3 AP_NavEKF3: Prevent on ground range to ground being used in flight 2022-12-10 10:34:44 +09:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output.cpp: Fix conversion precision issue: 2022-10-14 17:13:10 +09:00
AP_Notify AP_Notify: tidy includes 2022-05-03 09:14:58 +10:00
AP_OLC AP_OLC: tidy includes 2022-05-03 09:14:58 +10:00
AP_ONVIF AP_ONVIF: fix executable permission and trailing whitespace 2022-06-08 08:16:42 +09:00
AP_OpenDroneID AP_OpenDroneID: set EMERGENCY status on crash or chute deploy 2023-02-11 09:42:55 +09:00
AP_OpticalFlow AP_OpticalFlow: allow use of OpticalFlow on SimOnHardWare 2022-08-24 18:27:32 +10:00
AP_OSD AP_OSD: fix error in stats screen introduced in #18396 2022-11-21 18:48:35 +09:00
AP_Parachute AP_Parachute: params always use set method 2022-08-03 13:43:48 +01:00
AP_Param AP_Param: fixed handling of long lines in defaults.parm 2022-10-14 17:13:10 +09:00
AP_PiccoloCAN AP_PiccoloCAN: fix for new param set 2022-10-04 16:50:08 +09:00
AP_Proximity AP_Proximity: Fix comments 2022-08-24 18:26:27 +10:00
AP_Radio AP_Radio: increase short board names to 23 chars 2022-10-04 16:50:08 +09:00
AP_Rally AP_Rally: tidy creation of Location from RallyLocation 2022-07-14 11:49:53 +10:00
AP_RAMTRON AP_RAMTRON: reduce scope for WITH_SEMAPHORE 2022-07-17 21:42:33 +10:00
AP_RangeFinder AP_RangeFinder: skip GPIO arming check on analog backend 2023-01-10 08:12:47 +09:00
AP_RCMapper AP_RCMapper: Increase parameter metadata range to match NUM_RC_CHANNELS 2022-06-21 09:57:44 +10:00
AP_RCProtocol AP_RCProtocol: on IOMCU don't allow protocol to change once detected 2023-02-11 09:42:55 +09:00
AP_RCTelemetry AP_RCTelemetry: report CRSF link rate rather than mode. 2023-01-10 08:12:47 +09:00
AP_Relay AP_Relay: added get() method for scripting 2022-10-24 22:23:32 +09:00
AP_RobotisServo AP_RobotisServo: disable with minmimize features and 1mb flash 2022-06-15 18:05:44 +10:00
AP_ROMFS AP_ROMFS: tidy includes 2022-05-03 09:14:58 +10:00
AP_RPM AP_RPM: fixed SITL RPM backend for new motor mask 2022-10-24 22:23:32 +09:00
AP_RSSI AP_RSSI: convert floating point divides into multiplys 2022-03-18 15:26:44 +11:00
AP_RTC AP_RTC: fix oldest_acceptable_date to be in micros 2022-02-10 09:22:30 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: guarantee that FAST_TASK tasks do run on every loop 2022-12-10 10:34:44 +09:00
AP_Scripting AP_Scripting: fixed alt frame error in ship landing 2023-01-20 09:58:14 +09:00
AP_SerialLED AP_SerialLED: enable 32 servo outs 2022-05-22 12:07:37 +10:00
AP_SerialManager AP_SerialManager: move multiple RC input error to pre-arm failure 2022-11-21 18:48:35 +09:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: params always use set method 2022-08-03 13:43:48 +01:00
AP_Soaring AP_Soaring: make function const 2022-07-20 17:28:39 +10:00
AP_Stats
AP_TECS AP_TECS: Assume flight at cruise speed if speed measurement not available 2022-10-04 16:50:08 +09:00
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: rename HAL_MISSION_ENABLED to AP_MISSION_ENABLED 2022-08-18 22:49:10 +10:00
AP_Torqeedo AP_Torqeedo : correct comment spelling 2022-05-24 20:27:45 +09:00
AP_Tuning AP_Tuning: tidy includes 2022-05-03 09:14:58 +10:00
AP_UAVCAN AP_UAVCAN: support sending pulses as PWM for DroneCAN actuators 2022-10-04 16:50:08 +09:00
AP_Vehicle AP_Vehicle: replace get_rate_bf_targets with get_rate_ef_targets 2023-02-11 09:42:55 +09:00
AP_VideoTX AP_VideoTX: ensure that Tramp changes are broadcast to the GCS 2022-10-04 16:50:08 +09:00
AP_VisualOdom AP_VisualOdom: only include log structure if enabled 2022-07-13 18:14:12 +10:00
AP_Volz_Protocol AP_Volz: disable with minmimize features 2022-06-15 18:05:44 +10:00
AP_WheelEncoder AP_WheelEncoder: Support changing update period 2023-01-10 08:12:47 +09:00
AP_Winch AP_Winch: stop libraries including AP_Logger.h in .h files 2022-04-08 19:18:38 +10:00
AP_WindVane AP_WindVane: params always use set method 2022-08-03 13:43:48 +01:00
APM_Control AP_Control: Support changing update period 2023-01-10 08:12:47 +09:00
AR_Motors AR_Motors: remove arming check to allow ackerman and skid-steering 2022-08-22 07:46:50 -04:00
AR_WPNav AR_WPNav: add accessors for accel and jerk limits 2022-09-06 11:23:51 +09:00
doc
Filter Filter: Support changing update period 2023-01-10 08:12:47 +09:00
GCS_MAVLink GCS_MAVlink: send_autopilot_state_for_gimbal_device sends ef z-axis rate target 2023-02-11 09:42:55 +09:00
PID PID: params always use set method 2022-08-03 13:43:48 +01:00
RC_Channel RC_Channel: add option to support ELRS at 420kbaud 2023-01-10 08:12:47 +09:00
SITL SITL: vicon odometry corrected 2022-12-10 10:34:44 +09:00
SRV_Channel SRV_Channel: change sw and output names to match new MOUNT params 2022-10-04 16:50:08 +09:00
StorageManager StorageManager: fix write_block() comment 2021-12-17 09:53:47 +09:00