ardupilot/libraries
Andrew Tridgell 476bddd9a3 HAL_ChibiOS: use HAL_I2C_INTERNAL_MASK 2018-07-14 17:51:50 +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_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_WPNav: check validity of kP 2018-07-10 18:07:50 +09:00
APM_Control APM_Control: New default PID values for balance bots 2018-07-06 19:41:09 +10:00
AP_ADC AP_ADC: correct compilter warnings 2018-03-02 09:26:37 +09:00
AP_ADSB AP_ADSB: fix snprintf warning 2018-05-25 12:54:25 -07:00
AP_AHRS AP_AHRS: fixed arming with no compass in plane 2018-07-14 17:49:52 +10:00
AP_AccelCal AP_AccelCal: stop using mavlink_snoop for target traffic 2018-03-28 09:28:23 +09:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: removed some old AVR code 2018-07-06 09:04:15 +10:00
AP_Airspeed AP_Airspeed: fixed airspeed filtering issue 2018-06-14 09:13:30 +10:00
AP_Arming AP_Arming: use check_enabled() in storage check 2018-07-10 15:41:44 +10:00
AP_Avoidance AP_Avoidance: track src with correct label - use MAVLink label 2018-05-25 12:44:59 +09:00
AP_BLHeli AP_BLHeli: changes from PR review 2018-06-19 09:36:03 +10:00
AP_Baro BARO_generic: add Dummy GCS to meet the requirement of AP_Baro::calibrate(). 2018-07-14 10:32:51 +10:00
AP_BattMonitor AP_BattMonitor: add BLHeli ESC to MONITOR param desc 2018-07-11 17:44:00 +09:00
AP_Beacon AP_Beacon: Use SITL singleton 2018-06-26 00:02:01 +01:00
AP_BoardConfig AP_BoardConfig: allow hwdef.dat override of BRD_TYPE 2018-07-12 12:33:32 +10:00
AP_Buffer
AP_Button
AP_Camera AP_Camera: Remove usage of analogPinToDigitalPin 2018-07-11 23:09:52 -07:00
AP_Common AP_Common: AP_FWVersion: create singleton 2018-06-18 19:10:37 +01:00
AP_Compass AP_Compass: default to right mag offsets for SITL 2018-07-13 10:19:01 +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 of example on small memory boards 2018-07-11 10:07:38 +10:00
AP_Follow AP_Follow: Add FOLL_ALT_SOURCE parameter, 0: absolute, 1: relative 2018-06-09 11:01:35 +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 ublox configuration 2018-06-24 15:25:00 -07:00
AP_Gripper AP_Gripper: add singleton 2018-06-11 19:07:39 +01:00
AP_HAL AP_HAL: setup HAL_I2C_INTERNAL_MASK for ChibiOS 2018-07-14 17:51:50 +10:00
AP_HAL_AVR
AP_HAL_ChibiOS HAL_ChibiOS: use HAL_I2C_INTERNAL_MASK 2018-07-14 17:51:50 +10:00
AP_HAL_Empty AP_HAL_Empty: Remove GPIO::analogPinToDigitalPin() 2018-07-11 23:09:52 -07:00
AP_HAL_F4Light AP_HAL_F4Light: Remove GPIO::analogPinToDigitalPin() 2018-07-11 23:09:52 -07:00
AP_HAL_FLYMAPLE
AP_HAL_Linux AP_HAL_Linux: GPIO_RPi: Fix UB when reading a pin 2018-07-11 23:09:52 -07:00
AP_HAL_PX4 AP_HAL_PX4: Remove GPIO::analogPinToDigitalPin() 2018-07-11 23:09:52 -07:00
AP_HAL_SITL AP_HAL_SITL: Remove GPIO::analogPinToDigitalPin() 2018-07-11 23:09:52 -07:00
AP_HAL_VRBRAIN AP_HAL_VRBrain: Remove GPIO::analogPinToDigitalPin() 2018-07-11 23:09:52 -07:00
AP_ICEngine AP_ICEngine: Use RC_Channels instead of hal.rcin 2018-04-11 21:47:07 +01:00
AP_IOMCU AP_IOMCU: fixed repeated upload of IO fw 2018-07-11 09:51:43 +10:00
AP_IRLock AP_IRLock: Replace find_object with SITL singleton 2018-06-27 14:59:33 -07:00
AP_InertialNav AP_InertialNav: remove dead get_hagl method 2018-04-05 17:35:55 +09:00
AP_InertialSensor AP_InertialSensor: added SITL device IDs 2018-07-13 10:19:01 +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_LeakDetector
AP_Math AP_Math: quaternion requires isnan, so include math.h to get it 2018-07-02 09:31:11 +10:00
AP_Menu
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 output_test_num api for motor testing 2018-07-02 11:31:58 -04:00
AP_Mount AP_Mount: use ins singleton 2018-03-16 00:37:35 -07:00
AP_NavEKF AP_NavEKF: added gps_quality_good EKF flag 2018-07-14 17:49:52 +10:00
AP_NavEKF2 AP_NavEKF2: fill in gps_quality_good flag 2018-07-14 17:49:52 +10:00
AP_NavEKF3 AP_NavEKF3: fill in gps_quality_good flag 2018-07-14 17:49:52 +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: use I2C bus masks 2018-07-10 15:39:47 +10:00
AP_OSD AP_OSD: added OSD_MSG_TIME parameter 2018-07-14 09:07:42 +10:00
AP_OpticalFlow Global: remove minlure 2018-06-26 07:32:08 -07:00
AP_Parachute
AP_Param AP_Param: fixed build warning 2018-07-09 19:41:18 +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: add methods covering sensor health, enable and present 2018-06-26 10:25:28 +10:00
AP_RAMTRON AP_RAMTRON: added RAMTRON fram device driver 2018-01-15 11:46:02 +11:00
AP_RCMapper AP_RCMapper: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_RCProtocol AP_RCProtocol: improve s-bus parsing 2018-06-27 09:10:11 +10:00
AP_ROMFS AP_ROMFS: added support for compressed files in ROMFS 2018-07-09 19:41:56 +10:00
AP_RPM AP_RPM: Use SITL singleton 2018-06-26 00:02:01 +01:00
AP_RSSI AP_RSSI: add singleton 2018-05-08 12:33:32 +01:00
AP_RTC AP_RTC: return 0 from get_utc_usec if rtc not set 2018-06-15 08:01:22 +10:00
AP_Radio AP_Radio: fix fallthrough with ArduPilot macro 2018-05-22 15:25:00 +01:00
AP_Rally AP_Rally: Remove stale comment, and unneded define check 2018-04-11 09:45:45 +09:00
AP_RangeFinder AP_RangeFilter: Fix equality comparison with extraneous parentheses 2018-06-27 14:59:33 -07:00
AP_Relay AP_Relay: document BB Blue pin options 2018-05-03 15:35:28 +01:00
AP_SBusOut AP_SBusOut: removed create() method for objects 2017-12-14 08:12:28 +11:00
AP_Scheduler AP_Scheduler: use AP_FWVersion singleton 2018-06-18 19:10:37 +01:00
AP_SerialManager AP_SerialManager: fixed find_baudrate to return mapped baudrate 2018-07-09 15:41:48 +10:00
AP_ServoRelayEvents AP_ServoRelayEvents: add singleton 2018-04-18 20:31:55 +09:00
AP_SmartRTL AP_SmartRTL: use AP_FWVersion singleton 2018-06-18 19:10:37 +01:00
AP_Soaring AP_Soaring: const some accessors 2018-05-29 13:00:40 +10:00
AP_SpdHgtControl
AP_Stats AP_Stats: use AP_RTC 2018-06-15 08:01:22 +10:00
AP_TECS AP_TECS: use ins singleton 2018-03-16 00:37:35 -07:00
AP_TempCalibration AP_TempCalibration: remove duplicated parameter 2018-07-11 12:16:42 -07:00
AP_TemperatureSensor AP_TemperatureSensor: remove pointless constructor 2018-05-17 15:37:14 +10:00
AP_Terrain AP_Terrain: Reduce memory consumption, simplify enable checking 2018-06-29 09:00:01 +10:00
AP_Tuning AP_Tuning: Use RC_Channels instead of hal.rcin 2018-04-11 21:47:07 +01:00
AP_UAVCAN AP_UAVCAN: helper func 2018-06-09 22:46:48 -07:00
AP_Vehicle
AP_VisualOdom
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
DataFlash DataFlash: use compass singleton for logging 2018-07-04 20:11:27 +01:00
Filter
GCS_MAVLink GCS_MAVLink: correct bad fall-through 2018-07-06 10:43:17 +10:00
PID PID: Remove examples/keywords 2018-04-11 21:47:07 +01:00
RC_Channel RC_Channel: Remove unneeded interfaces 2018-06-11 16:29:36 -07:00
SITL SITL: setup more defaults with flightaxis 2018-07-13 10:19:01 +10:00
SRV_Channel SRV_Channel: move UAVCAN code from SRV to UAVCAN files 2018-05-25 13:53:17 +10:00
StorageManager StorageManager: allow for 15k storage 2018-06-24 08:26:28 +10:00
doc