ardupilot/libraries
Peter Barker 56473413d7 AC_Fence: support for multiple polygon fences
AC_Fence: add interface for retrieving exclusion polygons

AC_Fence: add interface to get exlusion polygons to polyfence loader

AC_Fence: add suport for inclusion circles

AC_Fence: add option for compiling-out FENCE_POINT protocol support

AC_Fence: get_exclusion_polygon and get_boundary_points set num_points to zero on failure

AC_Fence: use Debug(...) to hide debug messages

AC_PolyFence_loader: add methods to retrieve all inclusion zones

AC_PolyFence_loader: valid simply returns true if a polygon boundary can be returned

AC_Fence: add get_exclusion_circle

AC_Fence: add get_exclusion_circle_update_ms accessor

AC_Fence: PolyFence_loader gets inclusion circle accessors

AC_PolyFence_loader: add and use semaphore to protect loaded fence

AC_Fence: move fence breach check below fence type checks

This allows us to provide more information to the user about why they
are breached.

For example, if the radius is negative you are considered in breach of
it - but we'd tell you you were breached, not that your radius was
invalid

AC_Fence: clear the fence if we discover the user has set the fence count to zero
2020-02-05 10:09:54 +11:00
..
AC_AttitudeControl AC_AttitudeControl: Support seperate roll and pitch limits 2019-08-03 12:06:32 +09:00
AC_AutoTune AC_AutoTune: correct abs to fabsf for roll_cd and pitch_cd 2020-02-05 10:04:08 +11:00
AC_Avoidance AP_OADijkstra: cope with polyfence holding boundary points 2020-02-05 10:09:54 +11:00
AC_Fence AC_Fence: support for multiple polygon fences 2020-02-05 10:09:54 +11:00
AC_InputManager
AC_PID AC_HELI_PID: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AC_PrecLand AC_PrecLand: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AC_Sprayer AC_Sprayer: clean headers 2019-02-19 09:16:26 +11:00
AC_WPNav AC_WPNav: do not calculate NEU vector from invalid location 2020-02-05 10:04:08 +11:00
AP_AccelCal AP_AccelCal: remove wrapper around send_text 2019-07-30 10:06:42 +10:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: use ObjectBuffer in place of AP_Buffer 2020-02-05 10:05:59 +11:00
AP_AdvancedFailsafe AP_AdvancedFailSafe: add singleton getter 2020-02-05 10:04:08 +11:00
AP_AHRS AP_AHRS: fix custom orientation ToRad conversion 2019-10-06 10:58:07 +11:00
AP_Airspeed AP_Airspeed: switched to recursive semaphore 2019-11-20 07:35:07 +11:00
AP_Arming AP_Arming: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_Avoidance AP_Avoidance: stop copying adsb vehicle onto stack in src_id_for_adsb_vehicle 2019-07-16 10:30:55 +10:00
AP_Baro AP_Baro: LPS22H: correct formatting 2020-02-05 10:09:20 +11:00
AP_BattMonitor AP_BattMonitor: added Durandal selection for batt mon pins 2019-12-09 12:57:44 +11:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BLHeli AP_BLHeli: fixed critical errors caused by BLHeli code 2019-12-09 13:18:01 +11:00
AP_BoardConfig AP_BoardConfig: cleanup ifdefs for SLCAN enable 2019-10-07 21:14:24 +11:00
AP_Button AP_Button: use send_to_active_channels() 2019-06-06 12:41:48 +10:00
AP_Camera AP_Camera: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_Common AP_Common: Include altitude in the init check for a location 2020-02-05 10:04:08 +11:00
AP_Compass AP_Compass: Change direct value to define name 2020-02-05 10:09:20 +11:00
AP_Declination AP_Declination: re-generate mag tables 2020-01-10 19:12:10 +11:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_Filesystem AP_FileSystem: chunk IOs to max 4k 2020-01-18 12:27:51 +11:00
AP_FlashStorage AP_FlashStorage: added support for STM32F1xx 2019-08-27 10:29:56 +10:00
AP_Follow AP_Follow: correct parameter descriptions 2019-05-13 15:34:01 +10:00
AP_Frsky_Telem AP_Frsky_Telem: fixed a race condition with statustext handling 2020-01-10 18:48:17 +11:00
AP_GPS AP_GPS: use jitter correction on GPS_INPUT data 2020-02-05 10:04:08 +11:00
AP_Gripper AP_Gripper: unify singleton naming to _singleton and get_singleton() 2019-02-10 19:09:58 -07:00
AP_HAL AP_HAL: stop emitting extra CR before a LF as part of our printf 2019-12-25 12:00:37 +11:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: correct include of mavlink header for analog debug 2020-02-05 10:09:20 +11:00
AP_HAL_Empty AP_HAL_Empty: Remove set_stop_pin from AnalogSource 2019-09-04 09:54:50 +10:00
AP_HAL_Linux AP_HAL_Linux: PCA9685: Check for device before accessing it 2020-02-05 10:09:54 +11:00
AP_HAL_SITL AP_HAL_SITL: catch SIGTERM and exit with zero exit status 2020-02-05 10:05:59 +11:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_InertialNav AP_InertialNav: Remove unneeded methods 2019-07-16 12:11:42 +09:00
AP_InertialSensor AP_InertialSensor: default fast sampling on 2019-12-23 09:56:26 +11:00
AP_InternalError AP_InternalError: add a general should-not-be-here bit 2020-02-05 10:09:54 +11:00
AP_IOMCU AP_IOMCU: added a health check based on status read errors 2020-01-18 12:27:42 +11:00
AP_IRLock AP_IRLock: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: Fix includes 2019-04-05 20:12:53 +11:00
AP_L1_Control AP_L1_Control: wrap_180_cd no longer solely returns floats 2020-02-05 10:04:08 +11:00
AP_Landing AP_Landing: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_LandingGear AP_LandingGear: minor format fix 2019-05-11 08:49:40 +09:00
AP_LeakDetector AP_LeakDetector: Mark Leak pins RebootRequired 2019-09-09 09:53:28 -07:00
AP_Logger AP_Logger: fixed use of old irqsave() API 2020-02-05 10:04:08 +11:00
AP_Math AP_Math: define != for Vector2<int> 2020-02-05 10:09:54 +11:00
AP_Menu
AP_Mission Revert "AP_Mission: Better AUTO watchdog restore" 2019-08-27 13:18:12 -06:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors APMotors_6DOF: Implement motor_is_enabled(), get_motor_angular_factors() and set_reversed(); 2020-02-05 10:09:54 +11:00
AP_Mount switch optimisation to O2 2019-10-06 10:58:07 +11:00
AP_NavEKF AP_NavEKF: fixed build with vector index checking 2019-10-06 10:58:07 +11:00
AP_NavEKF2 AP_NavEKF2: initialise Kfusion stack variable to fix compilation 2020-02-05 10:09:20 +11:00
AP_NavEKF3 AP_NavEKF3: moved intermediate variables to common memory 2020-02-05 10:09:00 +11:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: NavEKF constructors no longer take rangefinder 2019-12-23 09:56:26 +11:00
AP_Notify AP_Notify: added NTZ_BUZZ_VOLUME parameter 2019-09-10 16:22:33 +10:00
AP_OpticalFlow AP_OpticalFlow: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_OSD AP_OSD: distance total fix for slow vehicles 2020-02-05 10:09:54 +11:00
AP_Parachute AP_Parachute: Added time check for sink rate to avoid glitches 2019-04-30 10:04:58 +10:00
AP_Param AP_Param: Fix failing to invalidate the cached parameter count 2020-01-15 14:03:36 +11:00
AP_Proximity AP_Proximity: cope with polyfence holding boundary points 2020-02-05 10:09:54 +11:00
AP_Radio AP_Radio: Change direct value to define name 2020-02-05 10:09:20 +11:00
AP_Rally AP_Rally: adjust to allow for uploading via the mission item protocol 2019-05-22 08:53:45 +10:00
AP_RAMTRON AP_RAMTRON: removed unusued AP_Common/Semaphore.h 2019-05-15 15:33:48 +10:00
AP_RangeFinder AP_RangeFinder: update minimum fw version of TFMiniPlus 2020-02-05 10:05:59 +11:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: fixed support for 22ms multi-frame DSM 2020-01-10 18:48:42 +11:00
AP_Relay AP_Relay: change parameter name from relay to instance 2020-02-05 10:09:54 +11:00
AP_RobotisServo AP_RobotisServo: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_ROMFS AP_ROMFS: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_RPM AP_RPM: Added Arduino RPM Sensor Debug Tool 2019-08-20 09:13:09 +10:00
AP_RSSI AP_RSSI: resolve gcs::send_text compiler warning 2019-07-30 09:02:39 +09:00
AP_RTC AP_RTC: add local time support 2019-11-17 11:40:29 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: cope with high CPU load by stretching loop times 2019-09-22 21:08:34 +10:00
AP_Scripting AP_Scripting: use AP_Filesystem API 2019-08-27 15:40:43 +10:00
AP_SerialManager AP_SerialManager: ensure users can't break SERIAL0_PROTOCOL 2020-01-10 19:12:10 +11:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: rangefinder no longer takes SerialManager in constructor 2019-07-16 09:29:48 +10:00
AP_Soaring AP_Soaring: move include of logger to .cpp file 2019-07-09 10:57:20 +10:00
AP_SpdHgtControl AP_SpdHgtControl: remove unused includes 2019-07-09 10:57:20 +10:00
AP_Stats AP_Stats: Improve reset documentation (NFC) 2019-02-28 09:20:10 +09:00
AP_TECS AP_TECS: removed TECS_LAND_PMIN 2019-11-19 07:47:33 +11:00
AP_TempCalibration AP_TempCalibration: Include needed AP_Baro.h 2019-06-27 14:56:21 +10:00
AP_TemperatureSensor AP_TemperatureSensor: Update TSYS01 for Pixhawk2 2020-02-05 10:09:54 +11:00
AP_Terrain AP_Terrain: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_ToshibaCAN AP_ToshibaCAN: constify some local variables 2019-08-14 13:29:14 +09:00
AP_Tuning AP_Tuning: tidy includes 2019-07-09 10:57:20 +10:00
AP_UAVCAN AP_UAVCAN: support RTCMStream for RTCM injection 2019-11-17 11:58:52 +11:00
AP_Vehicle AP_Vehicle: added AP_Periph vehicle type 2019-08-27 10:29:56 +10:00
AP_VisualOdom AP_VisualOdom: Directly include needed headers 2019-08-28 13:13:03 +10:00
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 2018-10-17 12:54:22 +11:00
AP_WheelEncoder AP_WheelEncoder: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_Winch AP_Winch: support for upgrade to PID object 2019-07-25 17:38:15 +09:00
AP_WindVane AP_Windvane: caculate vehicles current tack 2020-02-05 10:09:54 +11:00
APM_Control APM_Control: AR_AttitudeControl: add description for new PID params 2020-02-05 10:05:59 +11:00
AR_WPNav AR_WPNav: make get_stopping_location public 2020-02-05 10:09:54 +11:00
doc
Filter Filter: Alter Notch filter formula to remove /0 and allow perfect notch. 2019-09-11 18:41:05 +10:00
GCS_MAVLink GCS_MAVLink: allow upload of fence using mission item protocol 2020-02-05 10:09:54 +11:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: added RC option for new takeoff mode 2019-11-17 11:29:13 +11:00
SITL SITL: adding Tricopter model in Webots 2020-02-05 10:09:54 +11:00
SRV_Channel SRV_Channel: add neopixel as an output type 2019-09-10 13:03:28 +10:00
StorageManager StorageManager: add write_uint8 alias for write_byte 2020-02-05 10:09:54 +11:00