ardupilot/libraries
Peter Barker 0ad53e53eb AP_HAL: move delay callback handling to base HAL Scheduler class
This allows us to move a lot of delay handling from vehicle classes into
HAL Scheduler.

The most notable improvement is that it moves the detection of recursion
into the Scheduler, out of each separate vehicle.
2018-05-09 16:15:38 +10:00
..
AC_AttitudeControl AC_AttitudeControl: fixed use of double precision maths 2018-05-07 11:43:23 +10:00
AC_Avoidance AC_Avoid: use elseif because value does not change 2018-04-23 19:45:50 +09:00
AC_Fence AC_Fence: hide ALT_MAX parameter from Rover 2018-01-22 20:42:31 +09:00
AC_InputManager AC_InputManager: removed create() method for objects 2017-12-14 08:12:28 +11:00
AC_PID AC_PID: Support new RC_Channels::read_input() 2018-04-26 08:00:09 +10:00
AC_PrecLand AC_PrecLand: replace AP_InertialNav by AHRS 2018-04-17 17:21:35 +09:00
AC_Sprayer AC_Sprayer: use ahrs singleton 2018-04-12 14:23:33 +09:00
AC_WPNav AC_Loiter: move defines to cpp 2018-04-04 10:45:10 +09:00
AP_AccelCal AP_AccelCal: stop using mavlink_snoop for target traffic 2018-03-28 09:28:23 +09:00
AP_ADC AP_ADC: correct compilter warnings 2018-03-02 09:26:37 +09:00
AP_ADSB AP_ADSB: use baro singleton 2018-03-08 21:20:05 -08:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: remove rcmap member from AP_AdvancedFailsafe 2018-05-05 18:06:31 +09:00
AP_AHRS AP_AHRS: called boost_end() on AHRS update 2018-05-05 07:45:53 +10:00
AP_Airspeed AP_AirSpeed: notify of calibration start 2018-04-02 23:25:05 +01:00
AP_Arming AP_Arming: Add a servo check that (<= min trim max) for all channels 2018-04-24 01:16:26 +01:00
AP_Avoidance AP_Avoidance: fixed use of fabs() 2018-05-07 11:43:23 +10:00
AP_Baro AP_Baro: fixed build warning 2018-05-07 11:43:23 +10:00
AP_BattMonitor AP_BattMonitor: NFC improve coments 2018-03-28 17:01:33 +09:00
AP_Beacon AP_Beacon: fixed reference to -debug build directory 2018-05-09 14:17:32 +10:00
AP_BLHeli AP_BLHeli: log bad telem CRCs 2018-04-09 15:32:04 +10:00
AP_BoardConfig AP_BoardConfig: Fix param doc for BRD_SAFETYOPTION 2018-05-08 17:18:03 +10:00
AP_Buffer Global: remove mode line from headers 2016-10-24 09:42:01 -02:00
AP_Button Global: remove mode line from headers 2016-10-24 09:42:01 -02:00
AP_Camera Camera: Track number of completed events 2018-03-13 00:00:56 +00:00
AP_Common AP_Common: remove AP_AHRS_NavEKF include from location class 2018-04-11 08:59:50 +09:00
AP_Compass AP_COMPASS: fix MAG3110 driver 2018-05-07 11:45:29 +10:00
AP_Declination AP_Declination: use floorf() 2018-05-07 11:43:23 +10:00
AP_Devo_Telem AP_Devo_Telem: fixed to check for have_position 2018-04-24 10:44:28 +10:00
AP_FlashStorage AP_FlashStorage: fixed build warning 2018-05-07 11:43:23 +10:00
AP_Follow AP_Follow: use ahrs singleton 2018-04-02 17:16:02 +01:00
AP_Frsky_Telem AP_Frsky_Telem: Remove unneeded battery failsafe parameters 2018-03-27 22:12:21 +01:00
AP_GPS AP_GPS: Document septentrio RXERROR flags 2018-05-06 20:32:39 -06:00
AP_Gripper AP_Gripper: build fix for ChibiOS 2018-01-15 11:46:02 +11:00
AP_HAL AP_HAL: move delay callback handling to base HAL Scheduler class 2018-05-09 16:15:38 +10:00
AP_HAL_AVR
AP_HAL_ChibiOS Changes to be committed: 2018-05-08 07:33:19 +10:00
AP_HAL_Empty HAL_Empty: fixed I2C get_device() interface 2018-01-15 11:46:02 +11:00
AP_HAL_F4Light HAL_F4Light: fixed boards definitions 2018-05-07 11:45:29 +10:00
AP_HAL_FLYMAPLE
AP_HAL_Linux HAL_Linux: use ceilf() 2018-05-07 11:43:23 +10:00
AP_HAL_PX4 HAL_PX4: fixup 2018-04-14 06:22:07 +10:00
AP_HAL_QURT HAL_QURT: implement _timer_tick in UARTDriver 2018-02-07 20:33:45 +11:00
AP_HAL_SITL AP_HAL_SITL: add wind type parameters 2018-05-02 07:32:25 -07:00
AP_HAL_VRBRAIN HAL_VRBrain: handle oneshot125 separately 2018-04-07 09:10:29 +10:00
AP_ICEngine AP_ICEngine: Use RC_Channels instead of hal.rcin 2018-04-11 21:47:07 +01:00
AP_InertialNav AP_InertialNav: remove dead get_hagl method 2018-04-05 17:35:55 +09:00
AP_InertialSensor AP_InertialSensor: parameterise sensor-rate logging, generalise it 2018-05-01 09:35:29 +10:00
AP_IOMCU AP_IOMCU: implement safety mask and safety pwm 2018-04-17 10:14:01 +10:00
AP_IRLock AP_IRLock: added override keyword 2017-04-14 08:47:39 +10:00
AP_JSButton AP_JSButton: Add servo toggle button function 2017-12-28 14:14:47 -05:00
AP_L1_Control AP_L1_Control: update_waypoint gets dist_min argument 2018-04-05 12:14:59 +09:00
AP_Landing AP_Landing: fixed use of double precision maths 2018-05-07 11:43:23 +10:00
AP_LandingGear AP_LandingGear: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_LeakDetector AP_LeakDetector: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Math AP_Math: avoid double maths when not needed 2018-05-07 11:43:23 +10:00
AP_Menu AP_Menu: Unify from print or println to printf. 2017-01-27 18:20:22 +11:00
AP_Mission AP_Mission: fix small bug in d5a4c6b 2018-04-26 23:21:29 +01:00
AP_Module AP_Module: use ins singleton 2018-03-16 00:37:35 -07:00
AP_Motors AP_Motors: Add current limiting to 6DOF motors for Sub 2018-04-29 17:16:34 -04:00
AP_Mount AP_Mount: use ins singleton 2018-03-16 00:37:35 -07:00
AP_NavEKF AP_NavEKF: Make the status unions use bool, add static asserts 2018-04-11 09:47:43 +09:00
AP_NavEKF2 AP_NavEKF2: send airspeed variance over mavlink 2018-04-30 15:41:31 +10:00
AP_NavEKF3 AP_NavEKF3: use single precision ceilf() 2018-05-07 11:43:23 +10:00
AP_Navigation AP_L1_Control: update_waypoint gets dist_min argument 2018-04-05 12:14:59 +09:00
AP_Notify AP_Notify: support buzzer backend on ChibiOS 2018-04-24 08:03:46 +10:00
AP_OpticalFlow AP_OpticalFlow: use ins singleton 2018-03-16 00:37:35 -07:00
AP_Parachute AP_Parachute: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Param AP_Param: make send_parameter_value_all a GCS method rather than static 2018-05-01 09:39:01 +10:00
AP_Param_Helper AP_Param_Helper: HAL_F4Light parameters divided into common and board specific 2018-03-05 15:00:18 +00:00
AP_Proximity AP_Proximity: correct debugginf for RPLidarA2 2018-04-10 16:25:54 +09:00
AP_Radio AP_Radio: fixed optimisation of AP_Radio drivers 2018-04-07 09:10:29 +10:00
AP_Rally AP_Rally: Remove stale comment, and unneded define check 2018-04-11 09:45:45 +09:00
AP_RAMTRON AP_RAMTRON: added RAMTRON fram device driver 2018-01-15 11:46:02 +11:00
AP_RangeFinder RangeFinder: fixed a crash when VL53L0X was enabled in the software but not connected. 2018-05-07 11:47:39 +10:00
AP_RCMapper AP_RCMapper: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_RCProtocol AP_RCProtocol: support DSM bind 2018-04-10 17:22:21 +10:00
AP_Relay AP_Relay: document BB Blue pin options 2018-05-03 15:35:28 +01:00
AP_ROMFS AP_ROMFS: library for embedding files 2018-04-17 08:44:44 +10:00
AP_RPM AP_RPM: support RPM pin input on ChibiOS 2018-04-07 09:10:29 +10:00
AP_RSSI AP_RSSI: add singleton 2018-05-08 12:33:32 +01:00
AP_SBusOut AP_SBusOut: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Scheduler AP_Scheduler: fixed use of sqrt() 2018-05-07 11:43:23 +10:00
AP_SerialManager AP_SerialManager: devo telemetry support (RX705/707) 2018-04-24 10:44:28 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: add singleton 2018-04-18 20:31:55 +09:00
AP_SmartRTL AP_SmartRTL: fixed build warning 2018-05-07 11:43:23 +10:00
AP_Soaring AP_Soaring: Use RC_Channels instead of hal.rcin 2018-04-11 21:47:07 +01:00
AP_SpdHgtControl AP_SpdHgtControl: added function to reset integrator 2017-03-14 08:20:48 +11:00
AP_Stats AC_Stats: NFC Statistics are read-only variables 2017-06-07 19:53:09 +09:00
AP_TECS AP_TECS: use ins singleton 2018-03-16 00:37:35 -07:00
AP_TempCalibration AP_TempCalibration: fix FALLTHROUGH 2018-03-21 08:24:56 +09:00
AP_TemperatureSensor AP_TemperatureSensor: use HAL_SEMAPHORE_BLOCK_FOREVER macro 2017-05-08 10:23:03 +09:00
AP_Terrain AP_Terrain: compiler warning printing %u with signed value 2018-04-06 07:40:37 +09:00
AP_Tuning AP_Tuning: Use RC_Channels instead of hal.rcin 2018-04-11 21:47:07 +01:00
AP_UAVCAN AP_UAVCAN: add can driver getter 2018-03-10 21:07:47 -08:00
AP_Vehicle AP_Vehicle: Add the ArduSub vehicle type. 2017-02-21 11:26:14 +11:00
AP_VisualOdom AP_VisualOdom: class accepts deltas from visual odom camera 2017-04-19 11:04:40 +09:00
AP_Volz_Protocol AP_Volz_Protocol: use AP::serialmanager() 2017-12-21 04:35:11 +00:00
AP_WheelEncoder AP_WheelEncoder: hide parameters by default 2018-02-12 12:16:41 +09:00
AP_Winch AP_Winch: remove redundant member 2017-10-27 09:20:38 +09:00
APM_Control AR_AttitudeControl: fix get_steering_out_heading while reversing 2018-05-06 16:58:00 +09:00
DataFlash DataFlash: Remove redundant state from MAVLink backend 2018-05-08 11:48:09 +10:00
doc
Filter Filter: added a notch filter 2017-08-29 13:52:29 +10:00
GCS_MAVLink GCS_MAVLink: move try_send_message handling of RC_CHANNELS_RAW up 2018-05-08 12:33:32 +01:00
PID PID: Remove examples/keywords 2018-04-11 21:47:07 +01:00
RC_Channel RC_Channels: Collapse has_new_input() with set_pwm_all() 2018-04-26 08:00:09 +10:00
SITL SITL: add wind type parameters 2018-05-02 07:32:25 -07:00
SRV_Channel SRV_Channel: check for rcout serial for blheli support 2018-04-07 09:10:29 +10:00
StorageManager StorageManager: fixed build warning 2018-05-07 11:43:23 +10:00