..
AC_AttitudeControl
AC_PosControl: remove alt_max
8 years ago
AC_Avoidance
AC_Avoidance: stop based on upward facing proximity sensor
8 years ago
AC_Fence
AC_Fence: shorten calculation of return value
8 years ago
AC_InputManager
Global: remove mode line from headers
8 years ago
AC_PID
AC_PID: expose filt_hz as a AP_Float
8 years ago
AC_PrecLand
AC_PrecLand: reserve parameter indices
8 years ago
AC_Sprayer
AC_Sprayer: use new SRV_Channels API
8 years ago
AC_WPNav
AC_WPNav: Reduced WPNAV_SPEED minimum to 20cm/s
8 years ago
APM_Control
APM_Control: Added derating of steering wheel
8 years ago
AP_ADC
Global: change Device::PeriodicCb signature
8 years ago
AP_ADSB
AP_ADSB: Change sprintf method to secure snprintf method.
8 years ago
AP_AHRS
AP_AHRS: fix description
8 years ago
AP_AccelCal
AP_AccelCal: fix bug preventing accel cal fit to run more than one iteration
8 years ago
AP_AdvancedFailsafe
AP_AdvancedFailsafe: adapt to new RC_Channel API
8 years ago
AP_Airspeed
Global: change Device::PeriodicCb signature
8 years ago
AP_Arming
AP_Arming: remove unused set_enabled_checks
8 years ago
AP_Avoidance
AP_Avoidance: add units to param descriptions
8 years ago
AP_Baro
AP_Baro: fix for change to timer API
8 years ago
AP_BattMonitor
Global: change Device::PeriodicCb signature
8 years ago
AP_Beacon
AP_Beacon: Changed if statements to switch statement.
8 years ago
AP_BoardConfig
AP_BoardConfig: switched to always using in-tree sensors
8 years ago
AP_Buffer
Global: remove mode line from headers
8 years ago
AP_Button
Global: remove mode line from headers
8 years ago
AP_Camera
AP_Camera: adapt to new RC_Channel API
8 years ago
AP_Common
Spell in comments
8 years ago
AP_Compass
AP_Compass: disable lis3mdl for now
8 years ago
AP_Declination
Global: remove mode line from headers
8 years ago
AP_FlashStorage
AP_FlashStorage: added erase_ok callback
8 years ago
AP_Frsky_Telem
AP_FrSky_Telem: fixed sign of vertical velocity (+ve up)
8 years ago
AP_GPS
AP_GPS: Update the number of leapseconds
8 years ago
AP_Gripper
AP_Gripper: Add missing parameter units
8 years ago
AP_HAL
AP_HAL: Bebop & Disco: move default param file path
8 years ago
AP_HAL_AVR
…
AP_HAL_Empty
Global: To nullptr from NULL.
8 years ago
AP_HAL_FLYMAPLE
…
AP_HAL_Linux
AP_HAL_Linux: add Led_Sysfs class.
8 years ago
AP_HAL_PX4
HAL_PX4: cleanup whitespace
8 years ago
AP_HAL_QURT
HAL_QURT: fixed a bug in new_input()
8 years ago
AP_HAL_SITL
SITL: Use the GPS_LEAPSECOND define
8 years ago
AP_HAL_VRBRAIN
Global: To nullptr from NULL.
8 years ago
AP_ICEngine
AP_ICEngine: adapt to new RC_Channel API
8 years ago
AP_IRLock
Global: change Device::PeriodicCb signature
8 years ago
AP_InertialNav
AP_InertialNav: expose get_hgt_ctrl_limit to parent class
8 years ago
AP_InertialSensor
Global: change Device::PeriodicCb signature
8 years ago
AP_L1_Control
AP_L1_Control: add missing parameter metadata
8 years ago
AP_Landing
Plane, TECS, AP_Landing: rename stage LAND_ABORT to ABORT_LAND
8 years ago
AP_LandingGear
AP_LandingGear: use new SRV_Channels API
8 years ago
AP_Math
AP_Math: Change mask value to hexadecimal number.
8 years ago
AP_Menu
Global: To nullptr from NULL.
8 years ago
AP_Mission
AP_Mission: don't wrap when masking via HIGH/LOWBYTE
8 years ago
AP_Module
Global: To nullptr from NULL.
8 years ago
AP_Motors
AP_Motors: allow single, tri and coax to be part of multicopter class
8 years ago
AP_Mount
AP_Mount: adapt to new RC_Channel API
8 years ago
AP_NavEKF
AP_NavEKF: remove EKF1
8 years ago
AP_NavEKF2
AP_NavEKF2: Correct display names, bitmask and units
8 years ago
AP_NavEKF3
AP_NavEKF3: Correct display names, bitmask and units
8 years ago
AP_Navigation
Global: remove mode line from headers
8 years ago
AP_Notify
AP_Notify: Disco: use new led sysfs backend or, if not available, legacy
8 years ago
AP_OpticalFlow
Global: change Device::PeriodicCb signature
8 years ago
AP_Parachute
AP_Parachute: adapt to new RC_Channel API
8 years ago
AP_Param
AP_Params: fix seg fault in debug function
8 years ago
AP_Proximity
AP_Proximity: add get_upward_distance
8 years ago
AP_RCMapper
Global: remove mode line from headers
8 years ago
AP_RPM
AP_RPM: make pwm_input driver start on demand
8 years ago
AP_RSSI
Global: remove mode line from headers
8 years ago
AP_Rally
Global: remove mode line from headers
8 years ago
AP_RangeFinder
RangeFinder_Bebop: Fix mode selection
8 years ago
AP_Relay
Global: remove mode line from headers
8 years ago
AP_Scheduler
Global: remove mode line from headers
8 years ago
AP_SerialManager
SerialManager: add beacon to list of protocols
8 years ago
AP_ServoRelayEvents
AP_ServoRelayEvents: fixed trim bug
8 years ago
AP_SpdHgtControl
Plane, AP_TECS: do not pass auto_land flag to TECS, it already knows it
8 years ago
AP_Stats
AP_Stats: Add missing parameter units
8 years ago
AP_TECS
Plane, TECS, AP_Landing: rename stage LAND_ABORT to ABORT_LAND
8 years ago
AP_Terrain
AP_Terrain: prevent use of invalid Location
8 years ago
AP_Tuning
AP_Tuning: adapt to new RC_Channel API
8 years ago
AP_Vehicle
Plane, TECS, AP_Landing: rename stage LAND_ABORT to ABORT_LAND
8 years ago
DataFlash
DataFlash: hide direct EK2/EK3 logging
8 years ago
Filter
Filter: added new constructor for 1p filter
8 years ago
GCS_Console
Global: remove mode line from headers
8 years ago
GCS_MAVLink
GCS_MAVLink: adapt to new RC_Channel API
8 years ago
PID
Global: remove mode line from headers
8 years ago
RC_Channel
RC_Channel: give access to internals to SRV_Channel
8 years ago
SITL
SITL: SIM_XPlane: fix fabsf/abs warning; location alts are in integer cm
8 years ago
SRV_Channel
SRV_Channel: added AP_Motors servo channel parameter upgrading
8 years ago
StorageManager
Global: remove mode line from headers
8 years ago
doc
…