..
AC_AttitudeControl
AC_AttitudeControl: added SMAX param docs
4 years ago
AC_AutoTune
…
AC_Autorotation
AC_Autorotation: remove unused variables
4 years ago
AC_Avoidance
AC_Avoid: hide params with enable flag
4 years ago
AC_Fence
…
AC_InputManager
…
AC_PID
AC_PID: added slew limiter AC_PID
4 years ago
AC_PrecLand
AC_PrecLand: correct @User field in ACC_P_NSE documentation
4 years ago
AC_Sprayer
…
AC_WPNav
AC_WPNav: remove unused reached_spline_destination
4 years ago
APM_Control
APM_Control: added SMAX param docs
4 years ago
AP_ADC
…
AP_ADSB
AP_ADSB: conditionally compile based on HAL_ADSB_ENABLED
4 years ago
AP_AHRS
AP_AHRS: add ARSPD_OPTION note to WIND_MAX
4 years ago
AP_AccelCal
…
AP_AdvancedFailsafe
…
AP_Airspeed
AP_Airspeed: add MATLAB based NMEA sensor example
4 years ago
AP_Arming
AP_Arming: arming check for osd menu
5 years ago
AP_Avoidance
AP_Avoidance: conditionally compile based on ADSB support
4 years ago
AP_BLHeli
AP_BLHeli: added have_telem_data() API
5 years ago
AP_Baro
AP_Baro: Delete unnecessary return processing
4 years ago
AP_BattMonitor
AP_BattMonitor: Update @value field in param to be increasing order
4 years ago
AP_Beacon
AP_Beacon: Nooploop driver
4 years ago
AP_BoardConfig
AP_BoardConfig: use AP_Filesystem for sdcard mount
4 years ago
AP_Button
…
AP_CANManager
AP_CANManager: redo filter configuration to make it work with STM32H7
4 years ago
AP_Camera
AP_Camera: keep trying to initialize RunCam after boot
4 years ago
AP_Common
AP_Common: Update AP_FWVersion struct to be used with binary parsers
4 years ago
AP_Compass
AP_Compass: Fix TYPEMASK bitmask
4 years ago
AP_Declination
…
AP_Devo_Telem
…
AP_EFI
…
AP_ESC_Telem
…
AP_Filesystem
AP_Filesystem: fixed build on gcc 9.3
4 years ago
AP_FlashStorage
…
AP_Follow
…
AP_Frsky_Telem
AP_Frsky_Telem: tidy mavlite message handling
4 years ago
AP_GPS
AP_GPS: Don't reset the entire buffer when handling RTCM data
4 years ago
AP_Generator
AP_Generator: remove unused variables
4 years ago
AP_Gripper
…
AP_GyroFFT
AP_GyroFFT: reduce locking to avoid contention and match thread priority to IO
4 years ago
AP_HAL
AP_HAL: removed fs_init()
4 years ago
AP_HAL_ChibiOS
HAL_ChibiOS: go via AP_Filesystem for mount/unmount operations
4 years ago
AP_HAL_Empty
AP_HAL_Empty: remove un-needed constructor
4 years ago
AP_HAL_Linux
AP_HAL_Linux: Fix PWM FS to follow the Kernel's 4.X instead 3.9
4 years ago
AP_HAL_SITL
SITL: add Maxell SMBus battery support
4 years ago
AP_Hott_Telem
…
AP_ICEngine
AP_ICEngine: check for valid RC input for ICE
4 years ago
AP_IOMCU
AP_IOMCU: fixed bug in SBUS output when scanning for FPort input
4 years ago
AP_IRLock
…
AP_InertialNav
…
AP_InertialSensor
AP_InertialSensor: Run vibration monitoring on all instances
4 years ago
AP_InternalError
AP_InternalError: added an internal error for GPIO ISR overload
4 years ago
AP_JSButton
…
AP_KDECAN
…
AP_L1_Control
…
AP_LTM_Telem
…
AP_Landing
AP_Landing: replace '@User: User' with '@User: Standard'
4 years ago
AP_LandingGear
…
AP_LeakDetector
AP_LeakDetector: Add navigator support
4 years ago
AP_Logger
AP_Logger: allow for retry of log open with LOG_DISARMED=1
4 years ago
AP_MSP
AP_MSP: fixed build warnings for MSP with AP_Periph
4 years ago
AP_Math
AP_Math: added crc_sum8
4 years ago
AP_Menu
…
AP_Mission
AP_Mission: add accessor for in_landing_flag()
4 years ago
AP_Module
…
AP_Motors
AP_Motors: eliminate flags structure
4 years ago
AP_Mount
AP_Mount: Improve instance validation check
4 years ago
AP_NMEA_Output
…
AP_NavEKF
AP_NavEKF: remove unused variables
4 years ago
AP_NavEKF2
AP_NavEKF2: minor comment fix
4 years ago
AP_NavEKF3
AP_NavEKF3: minor comment and format fixes
4 years ago
AP_Navigation
…
AP_Notify
AP_Notify: remove unused variables
4 years ago
AP_OLC
AP_OLC: remove use of algorithm header
4 years ago
AP_OSD
AP_OSD: get wind speed from wind vane on rover
4 years ago
AP_OpticalFlow
AP_OpticalFlow: aligned msp message data struct name to gps,baro and mag
5 years ago
AP_Parachute
AP_Parachute: move sink rate check to new method
4 years ago
AP_Param
AP_Param: Ignore FORMAT_VERSION param when loading SITL defaults
4 years ago
AP_PiccoloCAN
AP_PiccoloCAN: Constrain ESC command message rate
5 years ago
AP_Proximity
AP_Proximity: simplify get_horizontal_distances
4 years ago
AP_RAMTRON
…
AP_RCMapper
…
AP_RCProtocol
AP_RCProtocol: added FPort protocol test
4 years ago
AP_RCTelemetry
AP_RCTelemetry: integrate ahrs::get_variances change
4 years ago
AP_ROMFS
…
AP_RPM
…
AP_RSSI
AP_RSSI: create and use new AP_HAL::PWMSource object
5 years ago
AP_RTC
AP_RTC: added mktime(), used by AP_Filesystem and AP_GPS
4 years ago
AP_Radio
…
AP_Rally
…
AP_RangeFinder
AP_RangeFinder: remove unused variables
4 years ago
AP_Relay
…
AP_RobotisServo
…
AP_SBusOut
…
AP_Scheduler
AP_Scheduler: add the fast loop to task statistics
4 years ago
AP_Scripting
AP_Scripting: copter-wall-climber fix for climb rate limiting
4 years ago
AP_SerialLED
…
AP_SerialManager
AP_SerialManager: add airspeed type
4 years ago
AP_ServoRelayEvents
…
AP_SmartRTL
AP_SmartRTL: fixed build warning on gcc9
4 years ago
AP_Soaring
AP_Soaring: remove unused variables
4 years ago
AP_SpdHgtControl
…
AP_Stats
…
AP_TECS
AP_TECS: replace '@User: User' with '@User: Standard'
4 years ago
AP_TempCalibration
…
AP_TemperatureSensor
…
AP_Terrain
…
AP_ToshibaCAN
…
AP_Tuning
…
AP_UAVCAN
AP_UAVCAN: save some stack space
4 years ago
AP_Vehicle
AP_vehicle: added support for frsky bidirectional telemetry
4 years ago
AP_VisualOdom
AP_VisualOdom: T265 ignores position and speed for 1sec after reset
4 years ago
AP_Volz_Protocol
…
AP_WheelEncoder
AP_WheelEncoder: added SMAX param docs
4 years ago
AP_Winch
AP_Winch: correct Daiwa line lengtha and speed scaling
5 years ago
AP_WindVane
AP_WindVane: report apparent wind with named float
4 years ago
AR_WPNav
…
Filter
Filter: added slew rate filter
4 years ago
GCS_MAVLink
GCS_MAVLink: use micro64 instead of micros for time_usec
4 years ago
PID
…
RC_Channel
RC_Channel: add RC option for landing flare
4 years ago
SITL
SITL: improved multicopter simulation
4 years ago
SRV_Channel
SRV_Channels: refactor zero_rc_outputs() out of GCS_Mavlink
4 years ago
StorageManager
…
doc
…