Ardupilot2/libraries
Andrew Tridgell 45d82887b3 AP_IOMCU: fixed a safety reset case for IOMCU reset
if IOMCU resets in flight when user had disabled the safety switch
using the button then the IOCMU force safety code was not called
2021-05-25 12:14:01 +10:00
..
AC_AttitudeControl AC_AttitudeControl: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AC_Autorotation AC_Autorotation: Add copter vehicle type to flight log metadata 2021-02-08 22:09:49 -05:00
AC_AutoTune AC_AutoTune: Fix before squash 2021-05-24 20:13:37 +10:00
AC_Avoidance AC_Avoidance: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AC_Fence AC_Fence: Correct Rover metadata 2021-04-27 09:31:09 +09:00
AC_InputManager
AC_PID AC_PID: Fix before squash 2 2021-05-24 20:13:37 +10:00
AC_PrecLand AP_PrecLand: correct metatdata for YAW_ALIGN 2021-05-21 08:27:49 +09:00
AC_Sprayer AC_Sprayer: Change the tab code to whitespace 2020-04-27 09:28:51 +09:00
AC_WPNav AC_WPNav: Fix before squash 2021-05-24 20:13:37 +10:00
AP_AccelCal AP_AccelCal: rename from review feedback 2021-01-21 13:09:21 +11:00
AP_ADC
AP_ADSB AP_ADSB: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_AdvancedFailsafe AP_AdvancedFailsafe: move handling of last-seen-SYSID_MYGCS up to GCS base class 2021-04-07 17:54:21 +10:00
AP_AHRS AP_AHRS: PosControl fixes 2021-05-24 20:13:37 +10:00
AP_Airspeed AP_Airspeed: added ASP5033 driver 2021-03-28 07:50:34 +11:00
AP_Arming AP_Arming: fix _CHECKS param description 2021-05-06 16:22:18 +10:00
AP_Avoidance AP_Avoidance: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Baro AP_Baro: move from HAL_NO_LOGGING to HAL_LOGGING_ENABLED 2021-05-19 17:38:47 +10:00
AP_BattMonitor AP_BattMonitor: refector to use AP_ESC_Telem 2021-05-12 17:01:11 +10:00
AP_Beacon AP_Beacon: added const 2020-11-11 16:14:22 -08:00
AP_BLHeli AP_BLHeli: make sure telemetry is requested when there is only one motor 2021-05-25 11:05:50 +10:00
AP_BoardConfig AP_BoardConfig: added get_heater_duty_cycle() 2021-02-09 11:32:19 +11:00
AP_Button AP_Button: log auxillary function invocations 2021-04-29 13:00:40 +10:00
AP_Camera AP_Camera: Fix wrong comment in libraries/AP_Camera/AP_RunCam.cpp 2021-05-22 10:15:34 +10:00
AP_CANManager AP_CANManager: Delete unused methods 2021-05-23 09:09:20 +10:00
AP_Common AP_Common: fixed null termination bug in ExpandingString 2021-04-21 07:12:55 +10:00
AP_Compass AP_Compass: Use the value of pi 2021-05-23 16:58:55 +10:00
AP_DAL AP_DAL: remove separate calls to get delta-times for vel and ang 2021-03-13 11:29:29 +11:00
AP_Declination AP_Declination: re-generate mag tables 2019-12-24 11:33:10 +11:00
AP_Devo_Telem
AP_EFI AP_EFI: use enum class for protocol 2021-03-30 21:40:35 +11:00
AP_ESC_Telem AP_ESC_Telem: generalise ESC telemetry to allow harmonic notch handling with other ESCs 2021-05-12 17:01:11 +10:00
AP_ExternalAHRS AP_ExternalAHRS: remove message when EAHRS_TYPE is None 2021-04-14 14:46:03 +10:00
AP_Filesystem AP_Filesystem: fix build on macOS 2021-04-21 11:33:52 +10:00
AP_FlashStorage AP_FlashStorage: support STM32G4 2021-03-23 12:01:20 +11:00
AP_Follow AP_Follow: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_Frsky_Telem AP_Frsky_Telem: added (generic) failsafe status bit to frame 0x5001 2021-05-17 13:39:58 +10:00
AP_Generator AP_Generator: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_GPS AP_GPS: Nova: Remove unneeded injection override 2021-05-25 10:07:05 +10:00
AP_Gripper AP_Gripper: Change the tab code to whitespace 2020-04-27 09:29:02 +09:00
AP_GyroFFT AP_GyroFFT: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_HAL AP_HAL: allow motor poles to be recorded 2021-05-12 17:01:11 +10:00
AP_HAL_ChibiOS HAL_ChibiOS: expand pin map of G474 to cover 64 pin parts 2021-05-25 09:35:25 +10:00
AP_HAL_Empty AP_HAL_Empty: removed assert calls 2021-03-25 14:03:40 +11:00
AP_HAL_Linux AP_HAL_Linux: allow tone alarm types 2021-05-05 17:41:24 +10:00
AP_HAL_SITL AP_HAL_SITL: move from HAL_NO_LOGGING to HAL_LOGGING_ENABLED 2021-05-19 17:38:47 +10:00
AP_Hott_Telem AP_Hott_Telem: use GPS single-char representation of fix type 2021-02-18 08:59:23 +11:00
AP_ICEngine AP_ICEngine: add note about ICE_STARTCHN_MIN param 2021-05-11 09:12:05 +10:00
AP_InertialNav
AP_InertialSensor AP_InertialSensor_Invensense: set reset count to 1 if 10s has passed since last reset 2021-05-25 10:46:38 +10:00
AP_InternalError AP_InternalError: added invalid_arguments failure 2021-04-03 12:07:59 +09:00
AP_IOMCU AP_IOMCU: fixed a safety reset case for IOMCU reset 2021-05-25 12:14:01 +10:00
AP_IRLock AP_IRLock: Change the tab code to whitespace 2020-04-27 09:29:11 +09:00
AP_JSButton
AP_KDECAN AP_KDECAN: support ESC telemetry 2021-05-12 17:01:11 +10:00
AP_L1_Control AP_L1_Control: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Landing AP_Landing: Autoenable fence if required when landing was aborted 2021-03-05 14:52:46 +11:00
AP_LandingGear AP_LandingGear: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_LeakDetector AP_LeakDetector: update leak pin for navigator r3 2021-04-07 15:08:18 -04:00
AP_Logger AP_Logger: move from HAL_NO_LOGGING to HAL_LOGGING_ENABLED 2021-05-19 17:38:47 +10:00
AP_LTM_Telem AP_LTM_Telem: get airspeed sensor from singleton not AHRS object 2020-12-07 15:57:28 -08:00
AP_Math AP_Math: Fix before squash 2021-05-24 20:13:37 +10:00
AP_Menu
AP_Mission AP_Mission: log auxillary function invocations 2021-04-29 13:00:40 +10:00
AP_Module AP_Module: fix example 2021-03-03 18:07:38 +11:00
AP_Motors AP_Motors: correct H_SV_MAN metadata warning 2021-05-25 10:22:21 +10:00
AP_Mount AP_Mount: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AP_MSP AP_MSP: generalise ESC telemetry to allow data from other ESCs 2021-05-12 17:01:11 +10:00
AP_NavEKF AP_NavEKF: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF2 AP_NavEKF2: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF3 AP_NavEKF3: Fix typo in comment 2021-05-11 10:37:08 +10:00
AP_Navigation
AP_NMEA_Output AP_NMEA: fix example 2021-03-03 18:07:38 +11:00
AP_Notify AP_Notify: scale NCP5623 for for data range 2021-05-09 06:44:19 +10:00
AP_OLC AP_OLC: fixed build of OSD on SITL 2020-11-12 14:22:44 -08:00
AP_OpticalFlow AP_OpticalFlow: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AP_OSD AP_OSD: generalise ESC telemetry to allow data from other ESCs 2021-05-12 17:01:11 +10:00
AP_Parachute AP_Parachute: move sink rate check to new method 2020-10-06 16:14:59 +11:00
AP_Param AP_Param: allow save_sync without send 2021-04-21 07:12:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: add ESC telemetry support 2021-05-12 17:01:11 +10:00
AP_Proximity AP_Proximity: remove mavlink boundary clearing conditions 2021-05-02 20:03:56 -04:00
AP_Radio
AP_Rally AP_Rally: rename APMrover2 to Rover 2020-04-14 09:50:34 +09:00
AP_RAMTRON
AP_RangeFinder AP_RangeFinder: add get_temp and implement for NMEA driver 2021-04-20 09:17:48 +10:00
AP_RCMapper fix metadata to emit RCMAP_FORWARD and _LATERAL for Rover 2021-05-17 13:38:17 +10:00
AP_RCProtocol AP_RCProtocol: move AP_VideoTX to AP_VideoTX 2021-02-23 11:43:32 +11:00
AP_RCTelemetry AP_RCTelemetry: Do uart's nullptr check first 2021-05-11 10:24:50 +10:00
AP_Relay AP_Relay: Added support to Relay pins on BBBMini 2020-07-06 17:35:27 -07:00
AP_RobotisServo
AP_ROMFS AP_ROMFS: added crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: add explicit RPM_TYPE_SITL 2021-03-02 15:41:44 +11:00
AP_RSSI AP_RSSI: handle init ordering with MSP 2020-11-17 10:01:54 +11:00
AP_RTC AP_RTC: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_SBusOut
AP_Scheduler AP_Scheduler: fix example 2021-03-03 18:07:38 +11:00
AP_Scripting AP_Scripting: add motor matrix set throttle factor binding 2021-05-25 09:01:06 +09:00
AP_SerialLED AP_SerialLED: support ProfiLEDs 2020-03-10 10:37:26 +11:00
AP_SerialManager AP_SerialManager: add SmartAudio to docs 2021-05-11 10:29:15 +10:00
AP_ServoRelayEvents
AP_SmartRTL AP_SmartRTL: peek_point method peeks at next point 2021-04-03 12:07:59 +09:00
AP_Soaring AP_Soaring: Ensure minimum cruise times are respected when RC switch position is changed. 2021-04-12 18:38:10 +10:00
AP_SpdHgtControl
AP_Stats AP_Stats: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: Ensure no throttle output if is_gliding flag is true when flying without airspeed. 2021-05-19 17:53:43 +10:00
AP_TempCalibration AP_TempCalibration: Remove pointer check before delete 2021-02-04 09:01:19 +11:00
AP_TemperatureSensor AP_TemperatureSensor: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Terrain Ap_Terrain: make AP::terrain return a pointer 2021-04-07 20:56:01 +10:00
AP_ToshibaCAN AP_ToshibaCAN: generalise ESC telemetry to allow harmonic notch handling with other ESCs 2021-05-12 17:01:11 +10:00
AP_Tuning AP_Tuning: use AUX_PWM_TRIGGER_LOW and AUX_PWM_TRIGGER_HIGH 2021-02-10 18:48:06 +11:00
AP_UAVCAN AP_UAVCAN: move from HAL_NO_LOGGING to HAL_LOGGING_ENABLED 2021-05-19 17:38:47 +10:00
AP_Vehicle AP_Vehicle: optionally run the harmonic notch update at the loop rate 2021-05-19 17:35:16 +10:00
AP_VideoTX AP_VideoTX: correctly deal with unresolvable options requests 2021-05-12 18:03:28 +10:00
AP_VisualOdom AP_VisualOdom: fix T265 criteria for aligning to AHRS 2021-02-10 18:37:45 +11:00
AP_Volz_Protocol AP_Volz_Protocol scaling bugfix 2020-12-08 15:03:26 +11:00
AP_WheelEncoder AP_WheelEncoder: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Winch AP_Winch: correct Daiwa line lengtha and speed scaling 2020-09-09 11:56:00 +09:00
AP_WindVane AP_Windvane: set raw wind to zero if no speed sensor 2021-05-16 15:04:00 +01:00
APM_Control APM_Control: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AR_WPNav AP_WPNav: read turn G acceleration from Atitude control 2021-05-03 19:22:16 -04:00
doc
Filter Filter: add harmonic notch option to run at loop rate 2021-05-19 17:35:16 +10:00
GCS_MAVLink GCS_MAVLink: Fix build for builds with GPS_MAX_RECEIVERS = 1 2021-05-18 10:26:55 +10:00
PID
RC_Channel RC_Channel: change or to || 2021-05-19 20:54:30 +09:00
SITL SITL: added is_lock_step_scheduled() API 2021-05-24 20:13:37 +10:00
SRV_Channel SRV_Channel: Make _FUNCTION metadata consistent style 2021-05-25 10:04:48 +10:00
StorageManager StorageManager: Add missing const in member functions 2021-02-03 18:45:14 +11:00