ardupilot/libraries
Peter Barker aae524b9d5 AP_Mission: add sanity check that 16-bit commands aren't stored_in_location
This is a rather confusing problem when it happens during development,
so a sanity check is good.  What you see in dev is that your latitude
gets corrupted between when you store and retrieve it, with no warnings
that you're doing something wrong.
2019-10-18 15:16:21 +11:00
..
AC_AttitudeControl AC_PosControl: add high vibration compensation 2019-10-18 11:15:25 +09:00
AC_AutoTune AC_AutoTune: correct abs to fabsf for roll_cd and pitch_cd 2019-09-18 12:57:02 +10:00
AC_Avoidance AC_Avoidance: add enabled and margin accessors 2019-09-28 11:13:14 +09:00
AC_Fence AC_Fence: support for multiple polygon fences 2019-09-28 07:58:48 +09:00
AC_InputManager
AC_PID AC_PID: update pid_info when integrator set 2019-10-18 11:15:25 +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 2019-09-17 09:05:23 +09:00
AP_AccelCal AP_AccelCal: adjust for new vehicle base class 2019-10-08 11:26:04 +11:00
AP_ADC AP_ADC: remove keywords.txt 2019-02-17 22:19:08 +11:00
AP_ADSB AP_ADSB: added handle_adsb_vehicle() API 2019-10-16 13:13:24 +11:00
AP_AdvancedFailsafe AP_AdvancedFailSafe: add singleton getter 2019-09-17 09:13:43 +10:00
AP_AHRS AP_AHRS: add get_innovations 2019-10-18 11:15:25 +09:00
AP_Airspeed AP_Airspeed: protect sample timestamp while get data 2019-10-12 18:15:06 +11:00
AP_Arming AP_Arming: remove bogus ARMING_CHECK_NONE 'bitmask value' 2019-10-08 10:31:07 +11: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: added register checking and reset to DPS280 driver 2019-10-15 10:22:15 +11:00
AP_BattMonitor AP_BattMonitor: Detect bad configuration of failsafes 2019-08-26 18:57:59 +01:00
AP_Beacon AP_Beacon: Common modbus crc method 2019-07-12 15:33:21 +10:00
AP_BLHeli AP_BLHeli: Change descriptions in SERVO_BLH_PORT param to actual AP port 2019-10-05 16:35:59 +10:00
AP_BoardConfig AP_BoardConfig: correct include of AP_Vehicle_Type 2019-10-08 11:26:04 +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: removed fcntl overrides 2019-09-28 14:19:46 +10:00
AP_Compass AP_Compass: don't show too many params when max compasses 1 2019-10-16 08:58:52 +11:00
AP_Declination AP_Declination: added get_earth_field_ga() interface 2019-06-03 12:21:29 +10:00
AP_Devo_Telem AP_Devo_Telem: add floating point constant designators 2019-04-05 23:04:17 -07:00
AP_Filesystem AP_Filesystem: build fixes for SITL on macOS 2019-09-09 20:18:00 +10:00
AP_FlashStorage AP_FlashStorage: added support for STM32F1xx 2019-08-27 10:29:56 +10:00
AP_Follow AP_Follow: add clear_offsets_if_required method 2019-10-07 08:30:45 +09:00
AP_Frsky_Telem AP_Frsky_Telem: move FrSky handling to it's own thread 2019-09-05 10:50:17 +10:00
AP_GPS AP_GPS: fixed UAVCAN GPS status when disconnected 2019-10-14 19:08:37 -06: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: enabled SLCAN on fmuv2 and Pixhawk1-1M 2019-10-08 10:02:14 +11:00
AP_HAL_ChibiOS HAL_ChibiOS: added a f103-ADSB firmware 2019-10-16 13:13:24 +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 2019-09-26 12:42:12 +10:00
AP_HAL_SITL AP_HAL_SITL: ToneAlarm doesn't play tones if disabled via param 2019-10-16 16:00:35 +11:00
AP_ICEngine AP_ICEngine: Add missing header guard 2019-05-20 23:50:23 +01:00
AP_InertialNav AP_InertialNav: use ekf::get_vert_pos_rate during high vibration 2019-10-18 11:15:25 +09:00
AP_InertialSensor AP_InertialSensor: publish an IMU temperature 2019-10-10 13:23:03 +11:00
AP_InternalError AP_InternalError: add a general should-not-be-here bit 2019-09-28 07:58:48 +09:00
AP_IOMCU AP_IOMCU: fix IO fast channel mask 2019-10-01 07:13:33 +10: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 2019-09-18 12:57:02 +10: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: add vibration failsafe error subsystem 2019-10-18 11:15:25 +09:00
AP_Math AP_Math: make fill_nanf() use a signalling NaN 2019-10-01 17:35:26 +10:00
AP_Menu
AP_Mission AP_Mission: add sanity check that 16-bit commands aren't stored_in_location 2019-10-18 15:16:21 +11:00
AP_Module AP_Module: update example baro include 2019-06-27 14:56:21 +10:00
AP_Motors AP_Motors: make init_targets_on_arming global 2019-10-16 08:17:09 +09:00
AP_Mount AP_Mount: change optimisation from -O3 to -O2 2019-09-28 08:57:26 +10:00
AP_NavEKF AP_NavEKF: fixed build with vector index checking 2019-10-01 15:39:03 +10:00
AP_NavEKF2 AP_NavEKF2: reduce EK2_HRT_FILT max to 30 2019-10-18 11:15:25 +09:00
AP_NavEKF3 AP_NavEKF3: reduce EK3_HRT_FILT max to 30 2019-10-18 11:15:25 +09:00
AP_Navigation
AP_NMEA_Output AP_NMEA_Output: skip sending sentences if no space on UART 2019-10-08 11:07:19 +11:00
AP_Notify AP_Notify: add a simulated buzzer for SITL 2019-10-16 16:00:35 +11:00
AP_OpticalFlow AP_OpticalFlow: pass mavlink_message_t by const reference 2019-07-16 20:51:42 +10:00
AP_OSD AP_OSD: add clock panel 2019-10-07 19:55:42 +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: support @READONLY marker in param files 2019-09-12 10:50:30 +10:00
AP_Proximity AP_Proximity: declare RangeFinder as a class to avoid circular include issue 2019-10-08 11:26:04 +11:00
AP_Radio AP_Radio: Change direct value to define name 2019-09-24 13:23:24 +10: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: Add TF03-180 2019-10-15 10:07:53 +09:00
AP_RCMapper AP_RCMapper: Fix sub only documentation on channels 2019-07-23 09:29:48 +10:00
AP_RCProtocol AP_RCProtocol: fixed SUMD with 16 channels 2019-09-07 10:02:26 +10:00
AP_Relay AP_Relay: change parameter name from relay to instance 2019-09-27 12:02:38 +10: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-10-07 19:55:42 +11:00
AP_SBusOut AP_SBusOut: fix includes place and order 2019-03-26 10:27:54 +11:00
AP_Scheduler AP_Scheduler: use fill_nanf() on each scheduler function 2019-10-01 17:35:26 +10:00
AP_Scripting AP_Scripting: Fix up uint32_t manipulation, fix AP_Notify 2019-10-16 21:57:41 -07:00
AP_SerialManager AP_SerialManager: fixed AP_Periph build 2019-09-06 08:51:45 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: use Relay singleton 2019-07-03 23:59:24 -07:00
AP_SmartRTL AP_SmartRTL: fixup compile error 2019-10-04 10:01:49 +09: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: prevent rapid changing of pitch limits on landing approach 2019-08-01 11:28:22 +10: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 2019-09-27 13:08:26 -07: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 ADSB over UAVCAN 2019-10-16 13:13:24 +11:00
AP_Vehicle AP_Vehicle: add singleton 2019-10-15 13:24:20 +11: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: add SITL backend 2019-10-07 07:31:51 +11: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 2019-09-26 18:23:03 +09:00
APM_Control APM_Control: AR_AttitudeControl: add description for new PID params 2019-09-23 09:45:46 +09:00
AR_WPNav AR_WPNav: make get_stopping_location public 2019-09-27 09:09:47 +09:00
doc
Filter Filter: set the harmonic notch filter ref default to zero (disabled) 2019-10-10 20:26:02 +09:00
GCS_MAVLink GCS_MAVLink: fixed uninitialised bytes in send_named_float() 2019-10-17 13:50:35 +11:00
PID Global: rename desired to target in PID info 2019-07-25 17:38:15 +09:00
RC_Channel RC_Channel: Support for Standby functions 2019-10-17 14:57:18 +09:00
SITL SITL: create SITL tonealarm files to hold enable parameter 2019-10-16 16:00:35 +11:00
SRV_Channel SRV_Channel: renamed EPM to Gripper in FUNCTION param docs 2019-10-15 09:11:06 +09:00
StorageManager StorageManager: add write_uint8 alias for write_byte 2019-09-28 07:58:48 +09:00