Ardupilot2/libraries
2021-06-12 16:02:51 +10:00
..
AC_AttitudeControl AC_AttitudeControl: remove % as units on params that are unitless 2021-05-30 22:38:27 -07:00
AC_Autorotation
AC_AutoTune AC_AutoTune: Fix before squash 2021-05-24 20:13:37 +10: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 AP_PrecLand: correct metatdata for YAW_ALIGN 2021-05-21 08:27:49 +09:00
AC_Sprayer
AC_WPNav AC_WPNav: ensure that wp_radius greater than min 2021-06-09 10:55:15 +09:00
AP_AccelCal
AP_ADC
AP_ADSB
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: NavEKF: make set_origin and get_origin WARN_IF_UNUSED as base class 2021-06-12 00:01:23 +10:00
AP_Airspeed AP_Airspeed: added ASP5033 driver 2021-03-28 07:50:34 +11:00
AP_Arming Revert "AP_Arming: check for only first compass being disabled" 2021-06-02 17:10:19 +10:00
AP_Avoidance
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: add support for AP_Periph MPPT driver 2021-06-09 18:36:18 +10:00
AP_Beacon
AP_BLHeli AP_BLHeli: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +10:00
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_Camera AP_Camera: support RunCam Hybrid correctly 2021-06-09 17:04:27 +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_Common AP_Common: Location vec3 constructor zero out fields 2021-06-12 10:52:36 +09:00
AP_Compass AP_Compass: fixed build with AP_Periph compass 2021-06-09 15:09:46 +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: disallow file operations from main thread while armed 2021-06-09 15:08:28 +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_Generator
AP_GPS AP_GPS: add support for AP_Logger into AP_Periph 2021-06-08 09:57:55 +10:00
AP_Gripper
AP_GyroFFT
AP_HAL AP_HAL: reorganize precompiler for HAL_ENABLE_LIBUAVCAN_DRIVERS and HAL_MAX_PROTOCOL_DRIVERS 2021-06-09 18:36:18 +10:00
AP_HAL_ChibiOS AP_HAL_ChibiOS: Disable un-needed hardware drivers in SkyViper builds 2021-06-09 21:42:51 +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_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_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_Landing AP_Landing: fix advanced param metadata 2021-05-25 12:36:59 +10:00
AP_LandingGear
AP_LeakDetector AP_LeakDetector: update leak pin for navigator r3 2021-04-07 15:08:18 -04:00
AP_Logger AP_Logger: disallow log creation in main thread when armed 2021-06-09 15:08:28 +10:00
AP_LTM_Telem
AP_Math AP_Math: Update segment_to_segment_dis test 2021-06-12 13:31:52 +09:00
AP_Menu
AP_Mission AP_Mission: add support for AP_Logger into AP_Periph 2021-06-08 09:57:55 +10:00
AP_Module
AP_Motors AP_Motors: add comments to AP_MotorsUGV 2021-06-07 20:16:26 +09:00
AP_Mount AP_Mount: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +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_NavEKF
AP_NavEKF2 AP_NavEKF2: use first usable compass index to set magSelectIndex 2021-06-02 17:10:19 +10:00
AP_NavEKF3 AP_NavEKF3: remove getBodyFrameOdomDebug 2021-06-07 09:28:52 +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_NMEA_Output
AP_Notify AP_Notify: fixed probe on all internal NCP5623 LEDs 2021-06-01 09:19:51 +10:00
AP_OLC
AP_OpticalFlow AP_OpticalFlow: make centideg metadata incr and range consistent 2021-05-25 10:10:18 +10:00
AP_OSD AP_OSD: Fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +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_Prox: Add plane intersection code to closest_point_from_segment_to_obstacle 2021-06-12 13:31:52 +09:00
AP_Radio
AP_Rally AP_Rally: add support for AP_Logger into AP_Periph 2021-06-08 09:57:55 +10:00
AP_RAMTRON
AP_RangeFinder AP_Rangefinder: make backend get_reading() pure virtual 2021-06-09 10:52:00 +09:00
AP_RCMapper fix metadata to emit RCMAP_FORWARD and _LATERAL for Rover 2021-05-17 13:38:17 +10:00
AP_RCProtocol
AP_RCTelemetry AP_RCTelemetry: correct VTX power settings and pass parameter requests more quickly 2021-06-09 17:35:11 +10:00
AP_Relay
AP_RobotisServo
AP_ROMFS
AP_RPM AP_RPM: use HAL_EFI_ENABLED 2021-06-09 18:07:00 +10:00
AP_RSSI
AP_RTC
AP_SBusOut
AP_Scheduler AP_Scheduler: corrected tick counter overflow handling, fixes #17642 2021-06-10 12:46:27 +10:00
AP_Scripting AP_Scripting: add example of fixed wing doublets via scripting 2021-06-08 14:48:27 +10: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_TECS AP_TECS: added get_max_sinkrate() API 2021-06-05 13:05:30 +10:00
AP_TempCalibration
AP_TemperatureSensor
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_UAVCAN AP_UAVCAN: fix compilation when HAL_WITH_ESC_TELEM == 0 2021-06-09 21:42:51 +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: 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
APM_Control APM_Control: use FF to increase but not reduce tau in autotune 2021-05-25 12:14:38 +10:00
AR_WPNav AP_WPNav: read turn G acceleration from Atitude control 2021-05-03 19:22:16 -04:00
doc
Filter Filter: use CLASS_NO_COPY 2021-06-08 11:14:52 +10:00
GCS_MAVLink GCS_MAVLink: use HAL_EFI_ENABLED 2021-06-09 18:07:00 +10:00
PID
RC_Channel RC_Channel: refactor KILL_IMU of do_aux_function 2021-05-30 11:33:47 +10:00
SITL SITL: fixed order of rotations in tilt vehicles 2021-06-08 19:11:32 +10:00
SRV_Channel SRV_Channel: do not use AP_UAVCAN unless LIBUAVCAN is enabled 2021-06-09 18:36:18 +10:00
StorageManager StorageManager: add read_float and write_float 2021-06-06 11:41:30 +10:00