ardupilot/libraries
Andy Piper f0f8187c7f AC_Fence: add ability to auto-enable fence floor while doing fence checks
control copter floor fence with autoenable
autoenable floor fence with a margin
check for manual recovery only after having checked the fences
make auto-disabling for minimum altitude fence an option
output message when fence floor auto-enabled
re-use fence floor auto-enable/disable from plane
auto-disable on landing
do not update enable parameter when controlling through mavlink
make sure get_enabled_fences() actually returns enabled fences.
make current fences enabled internal state rather than persistent
implement auto options correctly and on copter
add fence names utility
use ExpandingString for constructing fence names
correctly check whether fences are enabled or not and disable min alt for landing in all auto modes
add enable_configured() for use by mavlink and rc
add events for all fence types
make sure that auto fences are no longer candidates after manual updates
add fence debug
make sure rc switch is the ultimate authority on fences
reset auto mask when enabling or disabling fencing
ensure auto-enable on arming works as intended
simplify printing fence notices
reset autofences when auot-enablement is changed
2024-07-24 08:24:06 +10:00
..
AC_AttitudeControl AC_AttitudeControl: add accessors to set rate limit 2024-07-01 22:57:55 -04:00
AC_Autorotation
AC_AutoTune AC_AutoTune: remove unused variables 2024-07-04 13:19:12 +10:00
AC_Avoidance AC_Avoidance: take into account minimum altitude fence when calculating climb rate 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: add ability to auto-enable fence floor while doing fence checks 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
AP_AccelCal
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_AdvancedFailsafe
AP_AHRS AP_AHRS: rename ins get_primary_accel to get_first_usable_accel 2024-06-26 17:12:12 +10:00
AP_Airspeed AP_Airspeed: make metadata more consistent 2024-07-02 11:34:29 +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: do not enable minimim altitude fence on arming 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_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_BLHeli AP_BLHeli:expand metadata of 3d and Reverse masks 2024-06-04 09:24:41 +10:00
AP_BoardConfig
AP_Button
AP_Camera AP_Camera: proper string formatting 2024-07-17 10:39:46 +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: 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_CSVReader
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 get_max_rpm_esc() 2024-06-26 17:36:54 +10:00
AP_ExternalAHRS AP_ExternalAHRS_VectorNav: Bugfixes and review comment address 2024-07-17 17:49:18 +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: support QURT with posix filesystem 2024-07-12 15:56:48 +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: use fence enable_configured() 2024-07-24 08:24:06 +10:00
AP_Generator AP_Generator: avoid use of int16_t-read 2024-07-02 10:13:24 +10:00
AP_GPS AP_GPS:Septentrio constellation choice 2024-07-23 10:32:32 +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: add adjustable wdg timeout for hwdefs 2024-07-23 19:53:38 +10:00
AP_HAL_Empty AP_HAL_Empty: removed run_debug_shell 2024-07-11 07:42:54 +10:00
AP_HAL_ESP32 AP_HAL_ESP32: use correct unformatted system ID length 2024-07-17 09:08:51 +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_InertialNav
AP_InertialSensor AP_InertialSensor: Fix persistent storing of IMU Z Scale 2024-07-23 11:59:49 +10:00
AP_InternalError
AP_IOMCU AP_IOMCU: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10: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: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_L1_Control
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_LTM_Telem
AP_Math AP_Math: Remove template parameter from constructor 2024-07-10 10:07:24 +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 comment about new fence API 2024-07-24 08:24:06 +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: Topotek image tracking fix 2024-07-23 10:51:09 +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: 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: log mag fusion selection to XKFS 2024-07-11 16:16:27 +10:00
AP_Navigation
AP_Networking AP_Networking: allow reconnection to TCP server or client 2024-07-17 18:20:14 +10:00
AP_NMEA_Output
AP_Notify AP_Notify: add support for blinking 1 LED for notify 2024-07-17 17:18:27 +10: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: cleanup printf warnings 2024-07-11 09:34:29 +10:00
AP_OSD AP_OSD: make AP_RANGEFINDER_ENABLED remove more code 2024-07-02 09:17:26 +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_Radio AP_Radio: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_Rangefinder: cleanup printf warnings 2024-07-11 09:34:29 +10:00
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_Relay
AP_RobotisServo
AP_ROMFS
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_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: use enum class for Action, number entries 2024-06-28 10:11:57 +10:00
AP_Soaring
AP_Stats
AP_SurfaceDistance
AP_TECS AP_TECS: Use aircraft stall speed 2024-07-23 10:37:24 +10:00
AP_TempCalibration AP_TempCalibration: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_TemperatureSensor AP_Temperature:expand metadata for analog sensors 2024-07-01 14:01:19 +10:00
AP_Terrain
AP_Torqeedo AP_Torqeedo: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
AP_Tuning
AP_Vehicle AP_Vehicle: add stall speed parameter for plane 2024-07-23 10:37:24 +10:00
AP_VideoTX
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
APM_Control APM_Control: 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
doc
Filter Filter: use NEW_NOTHROW for new(std::nothrow) 2024-06-04 09:20:21 +10:00
GCS_MAVLink GCS_MAVLink: use bitmask based enablement for fences 2024-07-24 08:24:06 +10:00
PID
RC_Channel RC_Channel: use fence enable_configured() 2024-07-24 08:24:06 +10:00
SITL SITL: SIM_Rover: add simulation for omni3 mecanum rover 2024-07-23 13:27:04 +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