..
AC_AttitudeControl
AC_PosControl: add get_horizontal_error
9 years ago
AC_Avoidance
AC_Avoidance: add adjust_velocity that accepts Vector3f for convenience
9 years ago
AC_Fence
AC_Fence: add polygon fence check to check_destination_within_fence
9 years ago
AC_InputManager
AC_InputManager_Heli: get_pilot_desired_throttle in 0 to 1 range
9 years ago
AC_PID
AC_PID: removed AFF from heli PID
9 years ago
AC_PrecLand
AC_PrecLand: re-order init to resolve compiler warning
9 years ago
AC_Sprayer
AP_Math: Replace the pythagorous* functions with a variadic template
9 years ago
AC_WPNav
AC_WPNav: remove shift_loiter_target
9 years ago
APM_Control
AP_SteerController: Adding support for Rovers driving reverse
9 years ago
APM_OBC
APM_OBC: Fix up after RC_Channels refactor
9 years ago
AP_ADC
AP_ADC: remove ADS7844
9 years ago
AP_ADSB
AP_ADSB: fixed comment for default chan -1 means transceiver is not detected
9 years ago
AP_AHRS
AP_AHRS: remove use of uninitialised variable
9 years ago
AP_AccelCal
AP_AccelCal: Fix typos
9 years ago
AP_Airspeed
AP_Airspeed: added ARSP_PSI_RANGE parameter
9 years ago
AP_Arming
AP_Arming: don't show the GPS arming error in SITL
9 years ago
AP_Avoidance
AP_Avoidance: get_location becomes a method on adsb rather than a abds vehicle
9 years ago
AP_Baro
AP_Baro: remove zero-init in constructor
9 years ago
AP_BattMonitor
AP_HAL_Linux: remove AP_HAL_Linux_Namespace header
9 years ago
AP_BoardConfig
AP_BoardConfig: fix check for PX4_V4
9 years ago
AP_Buffer
AP_Buffer: replace header guard with pragma once
9 years ago
AP_Button
AP_Button: check for space before sending BUTTON_CHANGE
9 years ago
AP_Camera
AP_Camera: clearer parameter docs for trigger pin
9 years ago
AP_Common
AP_Common: avoid using AP_Math is_zero() because it is classless
9 years ago
AP_Compass
AP_Compass: Remove i2c lockup count
9 years ago
AP_Declination
AP_Declination: Fix typos
9 years ago
AP_EPM
Revising ardupilot.com to .org
9 years ago
AP_Frsky_Telem
AP_Frsky_Telem: Fix typos
9 years ago
AP_GPS
AP_GPS_MAV: use GPS_INPUT_IGNORE_FLAGS
9 years ago
AP_HAL
AP_HAL: remove SPIDriver
9 years ago
AP_HAL_AVR
AP_HAL_AVR: remove examples
9 years ago
AP_HAL_Empty
AP_HAL_Empty: remove SPIDriver
9 years ago
AP_HAL_FLYMAPLE
AP_HAL_FLYMAPLE: remove hal
9 years ago
AP_HAL_Linux
AP_HAL_Linux: remove AP_HAL_Linux_Namespace header
9 years ago
AP_HAL_PX4
AP_HAL_PX4: remove I2CDriver
9 years ago
AP_HAL_QURT
AP_HAL_QURT: remove I2CDriver
9 years ago
AP_HAL_SITL
SITL: initialise sigaction structs - valgrind fix
9 years ago
AP_HAL_VRBRAIN
AP_HAL_VRBRAIN: remove I2CDriver
9 years ago
AP_ICEngine
AP_ICEngine: report takeoff height set
9 years ago
AP_IRLock
AP_IRLock: refactor interface
9 years ago
AP_InertialNav
AP_InertialNav: Use separated EKF horiz/vert position interfaces
9 years ago
AP_InertialSensor
AP_InertialSensor: don't check {gyro,accel}_available twice
9 years ago
AP_L1_Control
AP_L1_Control: Adding support for rover's operating in reverse
9 years ago
AP_LandingGear
AP_LandingGear: replace header guard with pragma once
9 years ago
AP_Math
Math: move closest_point in from AC_Avoid
9 years ago
AP_Menu
AP_Menu: replace header guard with pragma once
9 years ago
AP_Mission
AP_Mission: support DO_ENGINE_CONTROL
9 years ago
AP_Module
AP_Module: use ifdef in function, not caller
9 years ago
AP_Motors
AP_Motors: added H_RSC_POWER_NEGC and H_RSC_SLEWRATE
9 years ago
AP_Mount
AP_Mount: fixed typo
9 years ago
AP_NavEKF
AP_NavEKF: fix documentation errors
9 years ago
AP_NavEKF2
AP_NavEKF2: change priority of statustext messages
9 years ago
AP_Navigation
AP_Navigation: Adding set_reverse to virtual parent class
9 years ago
AP_Notify
AP_Notify: added handling of PLAY_TUNE message
9 years ago
AP_OpticalFlow
AP_OpticalFlow: fix optical flow initialization
9 years ago
AP_Parachute
AP_Parachute: resolve compile warning re init order
9 years ago
AP_Param
AP_Param: display defaults path on startup
9 years ago
AP_RCMapper
AP_RCMapper: replace header guard with pragma once
9 years ago
AP_RPM
AP_RPM: provide an RPM quality in SITL
9 years ago
AP_RSSI
AP_RSSI: use fabsf instead of abs
9 years ago
AP_Rally
AP_Rally: add is_valid method
9 years ago
AP_RangeFinder
AP_RangeFinder: fix bus for Lightware on some boards
9 years ago
AP_Relay
AP_Relay: replace header guard with pragma once
9 years ago
AP_Scheduler
AP_Scheduler:time_available value type invalid uint16_t to valid uint32_t.
9 years ago
AP_SerialManager
AP_SerialManager: remove special case for console
9 years ago
AP_ServoRelayEvents
AP_ServoRelayEvents: Fix up after RC_Channels refactor
9 years ago
AP_SpdHgtControl
AP_SpdHgtControl: update for changed API
9 years ago
AP_TECS
AP_TECS: Remove useless 'if' statement
9 years ago
AP_Terrain
AP_Terrain: use HAVE_PAYLOAD_SPACE()
9 years ago
AP_Tuning
AP_Tuning: don't warn of controller errors when disarmed
9 years ago
AP_Vehicle
AP_Vehicle: moved roll_limit_cd into AP_Vehicle
9 years ago
DataFlash
DataFlash: update to match revised EKF1 and EKF2 interface
9 years ago
Filter
Filter: add AverageFilter variant to save current sum
9 years ago
GCS_Console
GCS_Console: replace header guard with pragma once
9 years ago
GCS_MAVLink
GCS_MAVLink: send_collision_all
9 years ago
PID
PID: Remove unused method get_pid_4500
9 years ago
RC_Channel
RC_Channel: added output types for choke, ignition and starter
9 years ago
SITL
SITL: expand to 16 output channels
9 years ago
StorageManager
StorageManager: added storage region for signing keys
9 years ago
doc
doc: Fix typos
9 years ago