.. |
AC_AttitudeControl
|
AC_PosControl: remove unnecessary parentheses
|
8 years ago |
AC_Avoidance
|
AC_Avoidance: adjust_velocity_polygon accepts body-frame points
|
8 years ago |
AC_Fence
|
AC_Fence: Activate the create flag.
|
8 years ago |
AC_InputManager
|
Global: remove mode line from headers
|
8 years ago |
AC_PID
|
Global: remove mode line from headers
|
8 years ago |
AC_PrecLand
|
AC_PrecLand: use new in-tree IRLock driver
|
8 years ago |
AC_Sprayer
|
AC_Sprayer: disentangle ENABLED from permission-to-run
|
8 years ago |
AC_WPNav
|
AC_WPNav: remove ekf position reset handler
|
8 years ago |
APM_Control
|
APM_Control: add missing parameter metadata
|
8 years ago |
AP_ADC
|
AP_ADC: fix ADS1115 instantiation
|
8 years ago |
AP_ADSB
|
AP_ADSB: Set in the sprintf method.
|
8 years ago |
AP_AHRS
|
modify NavEKF2 for AHRS Test
|
8 years ago |
AP_AccelCal
|
AP_AccelCal: fix bug preventing accel cal fit to run more than one iteration
|
8 years ago |
AP_AdvancedFailsafe
|
Global: remove mode line from headers
|
8 years ago |
AP_Airspeed
|
AP_Airspeed: updated comment to match PR
|
8 years ago |
AP_Arming
|
AP_Arming: Do not set check results each time.
|
8 years ago |
AP_Avoidance
|
Global: To nullptr from NULL.
|
8 years ago |
AP_Baro
|
AP_Baro: added GND_EXT_BUS option
|
8 years ago |
AP_BattMonitor
|
AP_BattMonitor: add default PM definitions for Navio boards
|
8 years ago |
AP_Beacon
|
AP_Beacon: fix potential out-of-bounds write to beacon_state
|
8 years ago |
AP_BoardConfig
|
AP_BoardConfig: increase uavcan bus settle time to 2s
|
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
|
Global: remove mode line from headers
|
8 years ago |
AP_Common
|
AP_Common: added simple bitmask class
|
8 years ago |
AP_Compass
|
AP_Compass: use a set_and_notify for external and IDs
|
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
|
GPS: MAV driver fix for sanity checks of cog, sat count
|
8 years ago |
AP_Gripper
|
AP_Gripper: a valid() method
|
8 years ago |
AP_HAL
|
AP_HAL: added get_bus_address()
|
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: Scheduler: added _timer_tick for uartD
|
8 years ago |
AP_HAL_PX4
|
Revert "HAL_PX4: Add input parameter check."
|
8 years ago |
AP_HAL_QURT
|
Global: To nullptr from NULL.
|
8 years ago |
AP_HAL_SITL
|
SITL: Scheduler correct misplaced parenthese && switch to do while loop
|
8 years ago |
AP_HAL_VRBRAIN
|
Global: To nullptr from NULL.
|
8 years ago |
AP_ICEngine
|
Global: remove mode line from headers
|
8 years ago |
AP_IRLock
|
AP_IRLock: fixed build
|
8 years ago |
AP_InertialNav
|
Global: remove mode line from headers
|
8 years ago |
AP_InertialSensor
|
InertialSensor : MPU9250 utilize an explicit type cast to avoid the loss of a fractional part
|
8 years ago |
AP_L1_Control
|
AP_L1_Control: add missing parameter metadata
|
8 years ago |
AP_Landing
|
AP_Landing: abstract out init_start_nav_cnd work to landing lib
|
8 years ago |
AP_LandingGear
|
Global: remove mode line from headers
|
8 years ago |
AP_Math
|
AP_Math: Vector2 add == operator for int
|
8 years ago |
AP_Menu
|
Global: To nullptr from NULL.
|
8 years ago |
AP_Mission
|
AP_Mission: Align with spec better
|
8 years ago |
AP_Module
|
Global: To nullptr from NULL.
|
8 years ago |
AP_Motors
|
AP_Motors: MotorsHeli_Single utilize an explicit type cast to avoid the loss of a fractional part.
|
8 years ago |
AP_Mount
|
AP_Mount: allow computation of gps point target in earth fixed frame
|
8 years ago |
AP_NavEKF
|
AP_NavEKF: storeIndex remove second initialisation
|
8 years ago |
AP_NavEKF2
|
AP_NavEKF2: Don't use speed switch criteria when speed estimate is invalid
|
8 years ago |
AP_Navigation
|
Global: remove mode line from headers
|
8 years ago |
AP_Notify
|
AP_Notify: fixed threading on toshibaled i2c
|
8 years ago |
AP_OpticalFlow
|
AP_OpticalFlow: fixed build
|
8 years ago |
AP_Parachute
|
Global: remove mode line from headers
|
8 years ago |
AP_Param
|
AP_Param: avoid a notify if value is already correct
|
8 years ago |
AP_Proximity
|
AP_Proximity: set minimum boundary 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
|
AP_RangeFinder: fix hard fault with LightWareI2C
|
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
|
Global: remove mode line from headers
|
8 years ago |
AP_SpdHgtControl
|
Global: remove mode line from headers
|
8 years ago |
AP_Stats
|
AP_Stats: fix variable reset time bug
|
8 years ago |
AP_TECS
|
AP_TECS: fixed compiler warning
|
8 years ago |
AP_Terrain
|
AP_Terrain: add O_CLOEXEC in places missing it
|
8 years ago |
AP_Tuning
|
Global: remove mode line from headers
|
8 years ago |
AP_Vehicle
|
AP_Vehicle: migrate aparm "LAND_" params from plane to AP_Landing
|
8 years ago |
DataFlash
|
DataFlash: log range beacon fusion data
|
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: fixed build
|
8 years ago |
PID
|
Global: remove mode line from headers
|
8 years ago |
RC_Channel
|
RC_Channel: add method to get current radio out for a function
|
8 years ago |
SITL
|
SITL: remove duplicate
|
8 years ago |
StorageManager
|
Global: remove mode line from headers
|
8 years ago |
doc
|
…
|
|