.. |
AC_AttitudeControl
|
AC_PosControl: protect against POS_Z_P, ACCEL_Z_P divide-by-zero
|
8 years ago |
AC_Avoidance
|
AC_Avoidance: only stop below alt-fence if fence is enabled
|
8 years ago |
AC_Fence
|
AC_Fence: return failure message
|
8 years ago |
AC_InputManager
|
Global: remove mode line from headers
|
8 years ago |
AC_PID
|
AC_PID: example fix travis warning
|
8 years ago |
AC_PrecLand
|
AC_PrecLand: added BUS parameter for precision landing
|
8 years ago |
AC_Sprayer
|
AC_Sprayer: use new SRV_Channels API
|
8 years ago |
AC_WPNav
|
AC_WPNav: speed-up and down parameter min to 10cm/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: cleanup
|
8 years ago |
AP_AHRS
|
AP_AHRS: example fix travis warning
|
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
|
AP_Airspeed: example fix travis warning
|
8 years ago |
AP_Arming
|
AP_Arming: use compass get_offsets_max()
|
8 years ago |
AP_Avoidance
|
AP_Avoidance: Remove unutilized get_destination_perpendicular
|
8 years ago |
AP_Baro
|
AP_Baro: support for UAVCAN connected barometers
|
8 years ago |
AP_BattMonitor
|
AP_BattMonitor: fix warning in example
|
8 years ago |
AP_Beacon
|
AP_Beacon: Apply correct conversion from Pozyx beacon earth frame
|
8 years ago |
AP_BoardConfig
|
AP_BoardConfig: fix board type number for aerofc
|
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
|
Camera: Fix an incorrect label on CAM_DURATION
|
8 years ago |
AP_Common
|
AP_Common: example fix travis warning
|
8 years ago |
AP_Compass
|
AP_Compass: example fix travis warning
|
8 years ago |
AP_Declination
|
AP_Declination: example fix travis warning
|
8 years ago |
AP_FlashStorage
|
AP_FlashStorage: added erase_ok callback
|
8 years ago |
AP_Frsky_Telem
|
AP_FrSky_Telem: fix sending messages 3 times
|
8 years ago |
AP_GPS
|
AP_GPS: example fix travis warning
|
8 years ago |
AP_Gripper
|
AP_Gripper: Add missing parameter units
|
8 years ago |
AP_HAL
|
AP_HAL: example fix travis warning
|
8 years ago |
AP_HAL_AVR
|
AP_HAL_AVR: remove examples
|
9 years ago |
AP_HAL_Empty
|
AP_HAL_Empty: adapt to new api
|
8 years ago |
AP_HAL_FLYMAPLE
|
AP_HAL_FLYMAPLE: remove hal
|
9 years ago |
AP_HAL_Linux
|
AP_HAL_LINUX: example fix travis warning
|
8 years ago |
AP_HAL_PX4
|
AP_HAL_PX4: example fix travis warning
|
8 years ago |
AP_HAL_QURT
|
HAL_QURT: fixed a bug in new_input()
|
8 years ago |
AP_HAL_SITL
|
AP_HAL_SITL: definitions for CAN bus
|
8 years ago |
AP_HAL_VRBRAIN
|
AP_HAL_VRBRAIN: Unify from print or println to printf.
|
8 years ago |
AP_ICEngine
|
AP_ICEngine: Update for AHRS NED changes
|
8 years ago |
AP_IRLock
|
AP_IRLock: added override keyword
|
8 years ago |
AP_InertialNav
|
AP_InertialNav: Update for AHRS NED changes
|
8 years ago |
AP_InertialSensor
|
AP_InertialSensor: fixed invensense driver temp reading
|
8 years ago |
AP_JSButton
|
AP_JSButton: Change mode button function implementation
|
8 years ago |
AP_L1_Control
|
L1: Add loiter radius scaling based upon bank limits at sea level
|
8 years ago |
AP_Landing
|
AP_Landing: Leverage new nav_controller loiter radius interface
|
8 years ago |
AP_LandingGear
|
AP_LandingGear: use new SRV_Channels API
|
8 years ago |
AP_LeakDetector
|
AP_LeakDetector: New library and analog/digital sensor drivers
|
8 years ago |
AP_Math
|
AP_Math: example fix travis warning
|
8 years ago |
AP_Menu
|
AP_Menu: Unify from print or println to printf.
|
8 years ago |
AP_Mission
|
AP_Mission: Unify from print or println to printf.
|
8 years ago |
AP_Module
|
AP_Mount: example fix travis warning
|
8 years ago |
AP_Motors
|
AP_Motors: force roll motors to 0 in tailsitter when disarmed
|
8 years ago |
AP_Mount
|
AP_Mount: example fix travis warning
|
8 years ago |
AP_NavEKF
|
NavEKF: Add GPS vertical accuracy to nav_gps_flags
|
8 years ago |
AP_NavEKF2
|
AP_NavEKF2: apply height innovation floor only when barometer is in use
|
8 years ago |
AP_NavEKF3
|
AP_NavEKF3: fix documentation derivation references
|
8 years ago |
AP_Navigation
|
AP_Navigation: Add a loiter radius interface
|
8 years ago |
AP_Notify
|
AP_Notify: example fix travis warning
|
8 years ago |
AP_OpticalFlow
|
AP_OpticalFlow: example fix travis warning
|
8 years ago |
AP_Parachute
|
AP_Parachute: example fix travis warning
|
8 years ago |
AP_Param
|
AP_Param: allow for dynamic var_info tables
|
8 years ago |
AP_Proximity
|
AP_Proximity: minor fix to param description
|
8 years ago |
AP_RCMapper
|
AP_RCMapper: Add forward and strafe channel mappings for Sub
|
8 years ago |
AP_RPM
|
AP_RPM: example fix travis warning
|
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
|
AP_Rangefinder: example fix travis warning
|
8 years ago |
AP_Relay
|
Global: remove mode line from headers
|
8 years ago |
AP_Scheduler
|
AP_Scheduler: Set main loop rate to 400hz for Sub
|
8 years ago |
AP_SerialManager
|
AP_SerialManager: uartA with 460800 baud for aerofc
|
8 years ago |
AP_ServoRelayEvents
|
AP_ServoRelayEvents: Remove constraint on 'channel' value
|
8 years ago |
AP_Soaring
|
AP_Soaring: adding const qualifiers to some of soaring controller's methods
|
8 years ago |
AP_SpdHgtControl
|
AP_SpdHgtControl: added function to reset integrator
|
8 years ago |
AP_Stats
|
AP_Stats: Add missing parameter units
|
8 years ago |
AP_TECS
|
AP_TECS: disable bad descent for soaring
|
8 years ago |
AP_TemperatureSensor
|
AP_TemperatureSensor: Use powf instead of pow
|
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_UAVCAN
|
AP_UAVCAN: library for support of UAVCAN protocol
|
8 years ago |
AP_Vehicle
|
AP_Vehicle: Add the ArduSub vehicle type.
|
8 years ago |
DataFlash
|
Dataflash: example fix travis warning
|
8 years ago |
Filter
|
Filter: example fix travis warning
|
8 years ago |
GCS_Console
|
GCS_Console: Unify from print or println to printf.
|
8 years ago |
GCS_MAVLink
|
GCS_MAVLink: example fix travis warning
|
8 years ago |
PID
|
PID: example fix travis warning
|
8 years ago |
RC_Channel
|
RC_Channel: example fix travis warning
|
8 years ago |
SITL
|
SITL: support XPlane-11
|
8 years ago |
SRV_Channel
|
SRV_Channel: added set_rc_frequency
|
8 years ago |
StorageManager
|
StorageManager: example fix travis warning
|
8 years ago |
doc
|
doc: Fix typos
|
9 years ago |