ardupilot/libraries
Andrew Tridgell b7c6267ec6 AP_NavEKF2: ensure that EKF origin stays in sync on all cores
this prevents the EKF origin on different cores from being initialised
to different values. A common value is stored in the frontend and used
by a core if it doesn't have an origin
2019-09-23 11:56:23 +09:00
..
AC_AttitudeControl AC_PosControl: remove unnecessary init of last_update_xy_ms 2019-02-02 11:34:38 +09:00
AC_Avoidance AC_Avoid: constify a few local variables 2018-10-26 15:21:22 +09:00
AC_Fence AC_Fence: get_polygon_points does not include return point 2018-10-26 15:21:24 +09:00
AC_InputManager
AC_PID AC_PID: Fix D term initialisation 2018-09-15 10:16:04 +09:00
AC_PrecLand
AC_Sprayer
AC_WPNav AC_WPNav: prevent I term buildup during landing 2019-02-27 20:06:15 +09:00
AP_AccelCal
AP_ADC AP_ADC: update to match plane3.9.0 2018-08-02 12:38:37 +09:00
AP_ADSB
AP_AdvancedFailsafe
AP_AHRS AP_AHRS: only use enabled IMUs in DCM 2019-07-08 09:16:22 +09:00
AP_Airspeed AP_Airspeed: skip cal on watchdog reset 2019-05-28 17:47:19 +09:00
AP_Arming AP_Arming: rename rudder_arming to get_rudder_arming_type 2018-09-15 10:12:44 +09:00
AP_Avoidance
AP_Baro AP_Baro: check for all 1 ADC read on MS5611 2019-08-06 10:42:36 +09:00
AP_BattMonitor AP_BattMonitor: Increase solo's power off button delay time 2018-11-24 11:13:25 +09:00
AP_Beacon AP_Beacon: Use SITL singleton 2018-06-26 00:02:01 +01:00
AP_BLHeli AP_BLHeli: pass motor mask to serial_setup_output() 2018-08-06 11:17:33 +10:00
AP_BoardConfig AP_BoardConfig: auto-restore safety state on watchdog reset 2019-05-28 17:47:19 +09:00
AP_Buffer
AP_Button
AP_Camera AP_Camera: match plane3.9.0 2018-08-02 12:38:42 +09:00
AP_Common AP_Common: AP_FWVersion: create singleton 2018-06-18 19:10:37 +01:00
AP_Compass AP_Compass: fixed uninitialised CAN device ID bits 2019-09-11 16:59:55 +09:00
AP_Declination AP_Declination: added get_earth_field_ga() interface 2019-06-11 13:25:08 +09:00
AP_Devo_Telem
AP_FlashStorage AP_FlashStorage: fixed build of example on small memory boards 2018-07-11 15:32:35 +09:00
AP_Follow AP_Follow: add get bearing and distance accessors 2018-12-17 08:59:22 +09:00
AP_Frsky_Telem AP_Frsky_Telem: use AP_FWVersion singleton 2018-06-18 19:10:37 +01:00
AP_GPS AP_GPS: fixed u-blox F9 auto configuration 2019-07-06 08:42:37 +10:00
AP_Gripper AP_Gripper: add singleton 2018-06-11 19:07:39 +01:00
AP_HAL AP_HAL: added Invensensev2 defines 2019-07-10 17:00:40 +10:00
AP_HAL_AVR
AP_HAL_ChibiOS hwdef: Correct typo for mRo x2.1-777 USB PID 2019-09-16 11:29:56 +09:00
AP_HAL_Empty HAL_Empty: added empty flash driver 2019-05-28 17:47:19 +09:00
AP_HAL_F4Light HAL_F4Light: support uartG 2018-06-29 08:17:38 +10:00
AP_HAL_FLYMAPLE
AP_HAL_Linux HAL_Linux: added empty flash driver 2019-05-28 17:47:19 +09:00
AP_HAL_PX4 HAL_PX4: added empty flash driver 2019-05-28 17:47:19 +09:00
AP_HAL_SITL HAL_SITL: added empty flash driver 2019-05-28 17:47:19 +09:00
AP_HAL_VRBRAIN HAL_VRBrain: match plane 3.9.0 2018-08-02 12:38:40 +09:00
AP_ICEngine
AP_InertialNav
AP_InertialSensor AP_InertialSensor: switched on fast sampling on IMU3 by default on Pixhawk2 2019-09-16 11:41:35 +09:00
AP_IOMCU AP_IOMCU: update to latest IO firmware handling 2019-08-20 07:32:31 +09:00
AP_IRLock AP_IRLock: Replace find_object with SITL singleton 2018-06-27 14:59:33 -07:00
AP_JSButton
AP_L1_Control
AP_Landing
AP_LandingGear AP_LandingGear: Remove deploy_lock state 2018-09-03 16:50:13 +09:00
AP_LeakDetector
AP_Math AP_Math: added rotation_equal() 2018-10-01 14:29:05 +09:00
AP_Menu
AP_Mission AP_Mission: starts_with_takeoff_cmd skips past mav_cmd_nav_delay 2018-08-27 12:31:02 +09:00
AP_Module AP_Module: removed ADC.h include 2018-08-02 12:38:50 +09:00
AP_Motors AP_Motors: add support for Hexa-H frame 2019-09-16 11:23:03 +09:00
AP_Mount AP_Mount: don't use disabled IMUs in solo gimbal code 2019-07-08 09:16:22 +09:00
AP_NavEKF
AP_NavEKF2 AP_NavEKF2: ensure that EKF origin stays in sync on all cores 2019-09-23 11:56:23 +09:00
AP_NavEKF3 AP_NavEKF3: don't use disabled gyros in opticalflow takeoff detection 2019-07-08 09:16:22 +09:00
AP_Navigation
AP_Notify AP_Notify: don't use pinMode for pixracer LEDs 2019-05-28 17:47:19 +09:00
AP_OpticalFlow AP_OpticalFlow: support cx-of on all boards 2019-04-30 10:47:49 +09:00
AP_OSD AP_OSD: fixed fonts for new font system 2018-11-29 15:35:50 +11:00
AP_Parachute
AP_Param AP_Param: warn on last pass only about unknown parameters 2018-06-28 10:18:19 -07:00
AP_Param_Helper
AP_Proximity AP_Proximity: increase MAV driver timeout to 500ms 2018-10-26 15:21:14 +09:00
AP_Radio
AP_Rally
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: LightwareSerial driver handles invalid distances 2019-09-16 11:32:15 +09:00
AP_RCMapper
AP_RCProtocol AP_RCProtocol: on DSM sync error don't reset channel count 2019-01-14 12:05:29 +11:00
AP_Relay
AP_ROMFS AP_ROMFS: fixed error handling in tinflate 2018-08-07 13:27:47 +10:00
AP_RPM AP_RPM: set pin to input before attaching interrupt 2018-11-15 12:38:22 +11:00
AP_RSSI AP_RSSI: add V5 Nano to the RSSI_ANA_PIN param description 2019-02-02 10:34:49 +09:00
AP_RTC AP_RTC: return 0 from get_utc_usec if rtc not set 2018-06-15 08:01:22 +10:00
AP_SBusOut
AP_Scheduler AP_Scheduler: use AP_FWVersion singleton 2018-06-18 19:10:37 +01:00
AP_SerialManager AP_SerialManager: add optical flow to list of protocols 2018-12-17 09:05:35 +09:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: use AP_FWVersion singleton 2018-06-18 19:10:37 +01:00
AP_Soaring
AP_SpdHgtControl
AP_Stats AP_Stats: use set_and_save_ifchanged() 2018-08-06 21:46:42 +10:00
AP_TECS
AP_TempCalibration
AP_TemperatureSensor
AP_Terrain AP_Terrain: Reduce memory consumption, simplify enable checking 2018-06-29 09:00:01 +10:00
AP_Tuning
AP_UAVCAN AP_UAVCAN: helper func 2018-06-09 22:46:48 -07:00
AP_Vehicle
AP_VisualOdom
AP_Volz_Protocol
AP_WheelEncoder
AP_Winch
APM_Control APM_Control: get_throttle_out_from_pitch() accepts dt as argument 2018-06-28 21:55:20 +09:00
DataFlash AP_Logger: prevent log erase from triggering watchdog 2019-05-28 17:47:19 +09:00
doc
Filter Filter: fixed crash on zero cutoff frequency 2019-02-09 16:02:08 +11:00
GCS_MAVLink GCS_MAVLink: added method to lockup autopilot 2019-05-28 17:47:19 +09:00
PID
RC_Channel RC_Channel: added get_type() method 2019-07-08 10:18:09 +09:00
SITL SITL: match plane3.9.0 2018-08-02 12:38:48 +09:00
SRV_Channel SRV_Channel: fixes channel numbering for channel already assigned message 2018-08-01 15:03:46 +09:00
StorageManager StorageManager: allow for 15k storage 2018-06-24 08:26:28 +10:00