.. |
AC_AttitudeControl
|
AC_AttitudeControl: added a update_vel_controller_xy() API
|
8 years ago |
AC_Avoidance
|
AC_Avoidance: add adjust velocity by beacon fence
|
8 years ago |
AC_Fence
|
AC_Fence: reset fences breach on disable
|
8 years ago |
AC_InputManager
|
AC_InputManager: remove MAIN_LOOP_RATE in favour of parameter value
|
8 years ago |
AC_PID
|
AC_PID: minor formatting change
|
8 years ago |
AC_PrecLand
|
AC_PrecLand: Use SI units conventions in parameter units
|
8 years ago |
AC_Sprayer
|
AC_Sprayer: Use SI units conventions in parameter units
|
8 years ago |
AC_WPNav
|
AC_WPNav: add set_wp_destination_NED to accept target in meters NED
|
8 years ago |
APM_Control
|
AR_AttitudeControl: throttle and steering control library
|
8 years ago |
AP_ADC
|
…
|
|
AP_ADSB
|
AP_ADSB - update description of ADSB_RF_SELECT to say Rx-only devices are always in Rx mode
|
8 years ago |
AP_AHRS
|
AP_AHRS: send ekf status reports even when EKF inactive
|
8 years ago |
AP_AccelCal
|
AccelCal: Continously report success/failure to the GCS that requested the calibration
|
8 years ago |
AP_AdvancedFailsafe
|
AP_AdvancedFailsafe: Allow landing to be a termination action
|
8 years ago |
AP_Airspeed
|
AP_Airspeed: use FALLTHROUGH define
|
8 years ago |
AP_Arming
|
AP_Arming: check ahrs and gps differ by less than 10m
|
7 years ago |
AP_Avoidance
|
AP_Avoidance: Change the determination place of the index value.
|
8 years ago |
AP_Baro
|
AP_Baro: Adding a new LPS25H Barometer driver
|
8 years ago |
AP_BattMonitor
|
AP_BattMonitor: initial FMUv4pro support
|
8 years ago |
AP_Beacon
|
AP_Beacon: initialise counter in get_next_boundary_point
|
8 years ago |
AP_BoardConfig
|
AP_BoardConfig: clarify board type 2 also to be used on the Cube autopilot
|
8 years ago |
AP_Buffer
|
…
|
|
AP_Button
|
…
|
|
AP_Camera
|
AP_Camera: add const to some parameters
|
8 years ago |
AP_Common
|
AP_Common: fix Bitmask out-of-range values
|
8 years ago |
AP_Compass
|
AP_Compass: Add break to prevent fallthrough of PIXRACER to PIXHAWK_PRO
|
7 years ago |
AP_Declination
|
…
|
|
AP_FlashStorage
|
…
|
|
AP_Frsky_Telem
|
AP_Frsky_Telem: replace VDOP with extra GPS status bits
|
8 years ago |
AP_GPS
|
AP_GPS: parse RTK status in NMEA GGA message
|
8 years ago |
AP_Gripper
|
AP_Gripper: Improve the PWM parameters descriptions
|
8 years ago |
AP_HAL
|
AP_HAL: make in_main_thread public, pure and virtual
|
7 years ago |
AP_HAL_AVR
|
…
|
|
AP_HAL_Empty
|
global: remove AP_HAL::in_timerprocess()
|
8 years ago |
AP_HAL_FLYMAPLE
|
…
|
|
AP_HAL_Linux
|
AP_HAL_Linux: make in_main_thread const and override
|
7 years ago |
AP_HAL_PX4
|
AP_HAL_PX4: make in_main_thread const and override
|
7 years ago |
AP_HAL_QURT
|
AP_HAL_QURT: make in_main_thread const and override
|
7 years ago |
AP_HAL_SITL
|
AP_HAL_SITL: implement in_main_thread
|
7 years ago |
AP_HAL_VRBRAIN
|
AP_HAL_VRBRAIN: make in_main_thread const and override
|
7 years ago |
AP_ICEngine
|
AP_IceEngine: eliminate GCS_MAVLINK::send_statustext_all
|
8 years ago |
AP_IRLock
|
…
|
|
AP_InertialNav
|
…
|
|
AP_InertialSensor
|
AP_InertialSensor: remove raspilot
|
8 years ago |
AP_JSButton
|
AP_JSButton: input_hold_toggle -> input_hold_set
|
8 years ago |
AP_L1_Control
|
L1_Control: Ensure that LIM_BANK passes a sea level sanity check
|
8 years ago |
AP_Landing
|
AP_Landing: Support usage for termination
|
8 years ago |
AP_LandingGear
|
AP_LandingGear: add startup position selection parameter
|
8 years ago |
AP_LeakDetector
|
…
|
|
AP_Math
|
AP_Math: replace divide with multiply in distance_to_segment
|
8 years ago |
AP_Menu
|
…
|
|
AP_Mission
|
AP_Mission: add OPTIONS parameter
|
8 years ago |
AP_Module
|
AP_Module: correct example
|
8 years ago |
AP_Motors
|
AP_Motors: eliminate GCS_MAVLINK::send_statustext_all
|
8 years ago |
AP_Mount
|
AP_Mount: Use SI units conventions in parameter units
|
8 years ago |
AP_NavEKF
|
AP_NavEKF: Add monitoring of average EKF time step
|
8 years ago |
AP_NavEKF2
|
AP_NavEKF2: use rangefinder backend accessors
|
8 years ago |
AP_NavEKF3
|
AP_NavEKF3: use rangefinder backend accessors
|
8 years ago |
AP_Navigation
|
…
|
|
AP_Notify
|
AP_Notify: remove raspilot
|
8 years ago |
AP_OpticalFlow
|
AP_OpticalFlow: minor order declaration change
|
8 years ago |
AP_Parachute
|
AP_Parachute: Add function to return _release_in_progress status
|
8 years ago |
AP_Param
|
AP_Param: remove CLI
|
8 years ago |
AP_Proximity
|
AP_Proximity: add support for RP Lidar A2
|
7 years ago |
AP_RCMapper
|
…
|
|
AP_RPM
|
…
|
|
AP_RSSI
|
AP_RSSI: support receiver based RSSI protocols
|
8 years ago |
AP_Rally
|
AP_Rally: Use SI units conventions in parameter units
|
8 years ago |
AP_RangeFinder
|
AP_RangeFinder: use FALLTHROUGH define
|
8 years ago |
AP_Relay
|
…
|
|
AP_Scheduler
|
AP_Scheduler: remove loop-period argument from load_average
|
8 years ago |
AP_SerialManager
|
AP_SerialMananger: add RP-Lidar A2
|
7 years ago |
AP_ServoRelayEvents
|
…
|
|
AP_SmartRTL
|
AP_SmartRTL: complete rename to SmartRTL
|
8 years ago |
AP_Soaring
|
AP_Soaring: eliminate GCS_MAVLINK::send_statustext_all
|
8 years ago |
AP_SpdHgtControl
|
…
|
|
AP_Stats
|
AC_Stats: NFC Statistics are read-only variables
|
8 years ago |
AP_TECS
|
AP_TECS: gain scaler K_STE2Thr multiplies by (THRmax - THRmin)
|
8 years ago |
AP_TemperatureSensor
|
AP_TemperatureSensor: use HAL_SEMAPHORE_BLOCK_FOREVER macro
|
8 years ago |
AP_Terrain
|
AP_Terrain: cast to int32_t to avoid warning about signedness
|
8 years ago |
AP_Tuning
|
AP_Tuning: eliminate GCS_MAVLINK::send_statustext_all
|
8 years ago |
AP_UAVCAN
|
AP_UAVCAN: changes to servo bitmasks to support multiple instances, baro, compass, gps changes for several CAN interfaces
|
8 years ago |
AP_Vehicle
|
…
|
|
AP_VisualOdom
|
AP_VisualOdom: class accepts deltas from visual odom camera
|
8 years ago |
AP_WheelEncoder
|
AP_WheelEncoder: last_reading is last update time instead of system time
|
8 years ago |
DataFlash
|
DataFlash: protect write fd with semaphore
|
7 years ago |
Filter
|
Filter: added a notch filter
|
8 years ago |
GCS_Console
|
…
|
|
GCS_MAVLink
|
GCS_MAVLink: add break in default case
|
7 years ago |
PID
|
…
|
|
RC_Channel
|
RC_Channel: fixed bug in manual with TRIM == MIN
|
8 years ago |
SITL
|
SITL: Add tilthvec frame
|
7 years ago |
SRV_Channel
|
SRV_Channel: added copy_radio_in_out_mask()
|
8 years ago |
StorageManager
|
…
|
|
doc
|
…
|
|