ardupilot/libraries
Josh Henderson 0ae3730f11 AP_NavEKF3: non_GPS modes ensure EKF origin set only once and stays in sync
ekf3
2021-06-22 12:01:10 +10:00
..
AC_AttitudeControl AC_AttitudeControl: AC_PosControl: Remove extra accel limit 2021-06-21 14:14:23 +09:00
AC_AutoTune AC_AutoTune: Fix before squash 2021-05-24 20:13:37 +10:00
AC_Autorotation AC_Autorotation: Add copter vehicle type to flight log metadata 2021-02-08 22:09:49 -05:00
AC_Avoidance AC_Avoid: Change ALT_MIN param to be copter only 2021-06-12 13:31:52 +09:00
AC_Fence AC_Fence: provide compatability with bad integer-stored radii 2021-06-06 11:41:30 +10:00
AC_InputManager
AC_PID AC_PID: use CLASS_NO_COPY() 2021-06-08 11:14:52 +10:00
AC_PrecLand AC_PrecLand: Use rotate_xy instead of matrix multiplication 2021-06-14 15:59:52 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: AC_Loiter: Remove extra accel limit 2021-06-21 14:14:23 +09:00
APM_Control APM_Control: use FF to increase but not reduce tau in autotune 2021-05-25 12:14:38 +10:00
AP_ADC
AP_ADSB AP_ADSB: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_AHRS AP_AHRS: remove HIL support 2021-06-15 09:47:31 +10:00
AP_AccelCal AP_AccelCal: rename from review feedback 2021-01-21 13:09:21 +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_Airspeed AP_Airspeed: Remove unneeded initilization 2021-06-22 10:08:02 +10:00
AP_Arming AP_Arming: remove call to rcout->prepare_for_arming() 2021-06-22 09:55:27 +10:00
AP_Avoidance AP_Avoidance: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_BLHeli AP_BLHeli: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +10:00
AP_Baro AP_Baro: remove HIL support 2021-06-15 09:47:31 +10:00
AP_BattMonitor AP_BattMonitor: Rearrange battery parameters to reduce memory usage 2021-06-22 10:08:02 +10:00
AP_Beacon
AP_BoardConfig AP_BoardConfig: minor change to BRD_IMU_TARGTEMP param desc 2021-06-02 18:17:59 +10:00
AP_Button AP_Button: log auxillary function invocations 2021-04-29 13:00:40 +10:00
AP_CANManager AP_CANManager: add support for multiple protocols on AP_Periph using CANSensor 2021-06-09 18:36:18 +10:00
AP_Camera AP_Camera: support RunCam Hybrid correctly 2021-06-09 17:04:27 +10:00
AP_Common AP_Common: add more unitttests 2021-06-21 21:16:29 +10:00
AP_Compass AP_Compass: added probe method for MMC3416 compass 2021-06-22 09:52:49 +10:00
AP_DAL AP_DAL: add interface for first usable compass 2021-06-02 17:10:19 +10:00
AP_Declination
AP_Devo_Telem
AP_EFI AP_EFI: change to use HAL_EFI_ENABLED 2021-06-09 18:07:00 +10:00
AP_ESC_Telem AP_ESC_Telem: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +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: removed the 3s grace period for file ops when armed 2021-06-15 16:42:02 +10:00
AP_FlashStorage Docs: Change all references from dev.ardupilot.org to the appropriate documentation URLs. 2021-05-31 12:20:45 +10:00
AP_Follow
AP_Frsky_Telem AP_Frsky_Telem: added a parameter to set the default FRSky sensor ID for passthrough telemetry 2021-06-03 13:58:55 +10:00
AP_GPS AP_GPS: remove HIL support 2021-06-15 09:47:31 +10:00
AP_Generator AP_Generator: Simplify boolean expression 2021-02-23 10:30:05 +11:00
AP_Gripper
AP_GyroFFT AP_GyroFFT: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_HAL AP_HAL: add 1Hz update_channel_masks() 2021-06-22 09:55:27 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: add 1Hz update_channel_masks() 2021-06-22 09:55:27 +10:00
AP_HAL_Empty HAL_Empty: implement uart_info() 2021-06-05 18:52:33 +10:00
AP_HAL_Linux AP_HAL_Linux: AP::can().log_text() needs HAL_ENABLE_LIBUAVCAN_DRIVERS 2021-06-09 18:36:18 +10:00
AP_HAL_SITL AP_HAL_SITL: correct compilation for mission pread/pwrite ret check 2021-06-12 16:02:51 +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_IOMCU AP_IOMCU: fixed a safety reset case for IOMCU reset 2021-05-25 12:14:01 +10:00
AP_IRLock
AP_InertialNav
AP_InertialSensor AP_InertialSensor: remove HIL support 2021-06-15 09:47:31 +10:00
AP_InternalError AP_InternalError: specify size for error_t 2021-06-13 08:41:25 +10:00
AP_JSButton
AP_KDECAN AP_KDECAN: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +10:00
AP_L1_Control AP_L1_Control: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_LTM_Telem
AP_Landing AP_Landing: fix advanced param metadata 2021-05-25 12:36:59 +10: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: add Wh units 2021-06-22 09:19:40 +10:00
AP_MSP AP_MSP: Telem_Backend: do not round vertical speed to 1m/s 2021-05-26 18:33:27 +10:00
AP_Math AP_Math: SCurve check direction.length_squared is_zero 2021-06-14 13:26:44 +09:00
AP_Menu
AP_Mission AP_Mission: Cleanup the header to reduce flash cost 2021-06-22 10:08:02 +10:00
AP_Module AP_Module: fix example 2021-03-03 18:07:38 +11:00
AP_Motors AP_Motors: tidy frame description strings 2021-06-21 16:30:37 +10:00
AP_Mount AP_Mount: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AP_NMEA_Output AP_NMEA: fix example 2021-03-03 18:07:38 +11:00
AP_NavEKF AP_NavEKF: Change misnomer (NFC) 2021-03-19 17:49:27 +11:00
AP_NavEKF2 AP_NavEKF2: non_GPS modes ensure EKF origin set only once and stays in sync 2021-06-22 12:01:10 +10:00
AP_NavEKF3 AP_NavEKF3: non_GPS modes ensure EKF origin set only once and stays in sync 2021-06-22 12:01:10 +10:00
AP_Navigation AP_Navigation: make crosstrack_error_integrator pure virtual as nobody use the base class 2021-06-11 04:59:06 -07:00
AP_Notify AP_Notify: allow display and oreo leds to be disabled 2021-06-16 20:25:58 +10:00
AP_OLC
AP_OSD AP_OSD_Screen: Blink the OSD VTX Power element indicating configuration in progress 2021-06-16 18:49:13 +10:00
AP_OpticalFlow AP_OpticalFlow: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AP_Parachute
AP_Param AP_Param: allow save_sync without send 2021-04-21 07:12:55 +10:00
AP_PiccoloCAN AP_PiccoloCAN: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +10:00
AP_Proximity AP_Proximity: fix proximity status for upward facing rangefinder 2021-06-16 17:41:45 +09:00
AP_RAMTRON
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: correct VTX power settings and pass parameter requests more quickly 2021-06-09 17:35:11 +10:00
AP_ROMFS AP_ROMFS: added crc check in ROMFS decompression 2021-02-23 20:20:07 +11:00
AP_RPM AP_RPM: use HAL_EFI_ENABLED 2021-06-09 18:07:00 +10:00
AP_RSSI
AP_RTC AP_RTC: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_Radio
AP_Rally AP_Rally: add support for AP_Logger into AP_Periph 2021-06-08 09:57:55 +10:00
AP_RangeFinder AP_RangeFinder: Rearrange parameters to reduce memory usage 2021-06-22 10:08:02 +10:00
AP_Relay
AP_RobotisServo
AP_SBusOut
AP_Scheduler AP_Scheduler: Change the Task Performance Notification Level to Information 2021-06-13 22:47:24 -07:00
AP_Scripting AP_Scripting: update 6DoF mixer example 2021-06-21 09:58:05 +09:00
AP_SerialLED
AP_SerialManager Docs: Change all references from dev.ardupilot.org to the appropriate documentation URLs. 2021-05-31 12:20:45 +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: fixed filter constructor calls 2021-06-08 11:14:52 +10:00
AP_SpdHgtControl AP_SpdHgtControl: added get_max_sinkrate() 2021-06-05 13:05:30 +10:00
AP_Stats AP_Stats: Add missing const in member functions 2021-02-03 18:45:14 +11:00
AP_TECS AP_TECS: added get_max_sinkrate() API 2021-06-05 13:05:30 +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: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +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: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +10:00
AP_Vehicle AP_Vehicle: add QRTL always as Q_RTL_MODE option 2021-06-14 09:08:20 +10:00
AP_VideoTX AP_SmartAudio: Add pull down VTX option 2021-06-16 18:49:13 +10:00
AP_VisualOdom AP_VisualOdom: do not build on 1MB boards 2021-06-09 20:12:44 +09:00
AP_Volz_Protocol
AP_WheelEncoder AP_WheelEncoder: fixed PID constructor calls 2021-06-08 11:14:52 +10:00
AP_Winch
AP_WindVane AP_WindVane: fixed copying of filter objects 2021-06-08 11:14:52 +10:00
AR_WPNav AR_WPNav: add WP_PIVOT_DELAY parameter 2021-06-16 15:52:43 +09:00
Filter Filter: use CLASS_NO_COPY 2021-06-08 11:14:52 +10:00
GCS_MAVLink GCS_MAVLink: add support for MAV_CMD_RUN_PREARM_CHECKS 2021-06-21 09:41:17 +10:00
PID
RC_Channel RC_Channel: refactor KILL_IMU of do_aux_function 2021-05-30 11:33:47 +10:00
SITL SITL: increase servo_filter array size 2021-06-21 14:13:18 +10:00
SRV_Channel SRV_Channel: call rcout->update_channel_masks() at 1Hz 2021-06-22 09:55:27 +10:00
StorageManager StorageManager: add read_float and write_float 2021-06-06 11:41:30 +10:00
doc