.. |
AC_AttitudeControl
|
AC_AttitudeControl: WeatherVane: defualt to 0 gain on plane and early return
|
3 years ago |
AC_AutoTune
|
AC_AutoTune: Vector tidying
|
3 years ago |
AC_Autorotation
|
AC_Autorotation: mark logger Write() calls as streaming where appropriate
|
4 years ago |
AC_Avoidance
|
AC_Avoidance: get Vector3f when checking all components of relpos
|
3 years ago |
AC_Fence
|
AC_Fence: include cleanups
|
3 years ago |
AC_InputManager
|
…
|
|
AC_PID
|
AC_PID: tradheli-change param name from _VFF to _FF
|
3 years ago |
AC_PrecLand
|
AC_PrecLand: include cleanups
|
3 years ago |
AC_Sprayer
|
AC_Sprayer: use vector.xy().length() instead of norm(x,y)
|
3 years ago |
AC_WPNav
|
AC_WPNav: Support pause
|
3 years ago |
APM_Control
|
AR_AttitudeControl: use _desired_speed instead of desired_speed for throttle-speed controller
|
3 years ago |
AP_ADC
|
…
|
|
AP_ADSB
|
AP_ADSB: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_AHRS
|
AP_AHRS: convert param to new custom rotation
|
3 years ago |
AP_AIS
|
AP_AIS: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_AccelCal
|
AP_AccelCal: remove unused calc_mean_squared_residuals
|
3 years ago |
AP_AdvancedFailsafe
|
AP_AdvancedFailsafe: use mission singleton inside AP_AdvancedFailsafe
|
4 years ago |
AP_Airspeed
|
AP_Airspeed: improve description of ARSPD_TUBE_ORDR
|
3 years ago |
AP_Arming
|
AP_Arming: don't arming check servo functions set to GPIO
|
3 years ago |
AP_Avoidance
|
AP_Avoidance: tidy construction of vector on stack
|
3 years ago |
AP_BLHeli
|
AP_BLHeli: bring in hal.h
|
3 years ago |
AP_Baro
|
AP_Baro: include cleanups
|
3 years ago |
AP_BattMonitor
|
AP_BattMonitor: update name of type 10 to Sum of Selected Monitors
|
3 years ago |
AP_Beacon
|
AP_Beacon: have nooploop use base-class uart instance
|
3 years ago |
AP_BoardConfig
|
AP_BoardConfig: add options for write protecting bootloader and main flash
|
3 years ago |
AP_Button
|
AP_Button: include cleanups
|
3 years ago |
AP_CANManager
|
AP_CANManager: include hal.h
|
3 years ago |
AP_Camera
|
AP_Camera: include cleanups
|
3 years ago |
AP_Common
|
AP_Common: removed terrain home correction
|
3 years ago |
AP_Compass
|
AP_Compass: Fix compass priority instance message to make sense to users
|
3 years ago |
AP_CustomRotations
|
add AP_CustomRotations
|
3 years ago |
AP_DAL
|
AP_DAL: prevent logical loop between AHRS and EKF
|
3 years ago |
AP_Declination
|
AP_Declination: Remove meaningless semicolons
|
3 years ago |
AP_Devo_Telem
|
AP_Devo_Telem: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_EFI
|
AP_EFI: include cleanups
|
3 years ago |
AP_ESC_Telem
|
AP_ESC_Telem: correct spelling mili -> milli
|
3 years ago |
AP_ExternalAHRS
|
AP_ExternalAHRS: nuke clang warnings
|
3 years ago |
AP_FETtecOneWire
|
AP_FETtecOneWire: nuke clang warnings
|
3 years ago |
AP_Filesystem
|
AP_Filesystem: avoid ff.h in header
|
3 years ago |
AP_FlashIface
|
AP_FlashIface: add support for DTR variant of w25q found on SPRacingH7
|
3 years ago |
AP_FlashStorage
|
AP_FlashStorage: support L496 MCUs
|
3 years ago |
AP_Follow
|
AP_Follow: added APIs for plane ship landing
|
3 years ago |
AP_Frsky_Telem
|
AP_Frsky_Telem: nuke clang warnings
|
3 years ago |
AP_GPS
|
AP_GPS: include cleanups
|
3 years ago |
AP_Generator
|
AP_Generator: nuke clang warnings
|
3 years ago |
AP_Gripper
|
AP_Gripper: change UAVCAN to DroneCAN in param metadata
|
3 years ago |
AP_GyroFFT
|
AP_GyroFFT: fix 'arm_status' shadowing a global declaration error
|
3 years ago |
AP_HAL
|
AP_HAL: always choose high for dshot prescaler calculation
|
3 years ago |
AP_HAL_ChibiOS
|
hwdef: Set the maximum number of barometric pressure sensors to 1
|
3 years ago |
AP_HAL_ESP32
|
AP_HAL_ESP32: remove HAL_COMPASS_DEFAULT define
|
3 years ago |
AP_HAL_Empty
|
AP_HAL_Empty: add HAL_UART_STATS_ENABLED to disable stats gathering
|
3 years ago |
AP_HAL_Linux
|
HAL_Linux: support mavcan
|
3 years ago |
AP_HAL_SITL
|
AP_HAL_SITL: removed terrain home correction
|
3 years ago |
AP_Hott_Telem
|
AP_Hott_Telem: add define AP_AIRSPEED_ENABLED
|
3 years ago |
AP_ICEngine
|
AP_ICEngine: include cleanups
|
3 years ago |
AP_IOMCU
|
AP_IOMCU: rename and make enum RC_Channel::ControlType
|
3 years ago |
AP_IRLock
|
AP_IRLock: correct spelling mili -> milli
|
3 years ago |
AP_InertialNav
|
AP_InertialNav: nfc, fix to say relative to EKF origin
|
3 years ago |
AP_InertialSensor
|
AP_InertialSensor: remove custom orentations
|
3 years ago |
AP_InternalError
|
AP_InternalError: change panic to return error code as string in SITL
|
3 years ago |
AP_JSButton
|
…
|
|
AP_KDECAN
|
AP_KDECAN: Use HAL_CANMANAGER_ENABLED instead of HAL_ENABLE_LIBUAVCAN_DRIVERS
|
4 years ago |
AP_L1_Control
|
AP_L1_Control: update_waypoint wrap added to nav_bearing
|
3 years ago |
AP_LTM_Telem
|
AP_LTM_Telem: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_Landing
|
AP_Landing: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_LandingGear
|
AP_LandingGear: add enable param
|
3 years ago |
AP_LeakDetector
|
AP_LeakDetector: check for valid analog pin
|
3 years ago |
AP_Logger
|
AP_Logger: log structure: update airspeed heath probability feild name
|
3 years ago |
AP_MSP
|
AP_MSP: include cleanups
|
3 years ago |
AP_Math
|
AP_Math: fixed build error on cygwin
|
3 years ago |
AP_Menu
|
…
|
|
AP_Mission
|
AP_Mission: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_Module
|
AP_Module: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_Motors
|
AP_Motors: update no motor found warning message
|
3 years ago |
AP_Mount
|
AP_Mount: mark result of get_velocity as unused
|
3 years ago |
AP_NMEA_Output
|
AP_NMEA_Output: use a fixed maximum number of NMEA outputs
|
3 years ago |
AP_NavEKF
|
AP_NavEKF : remove the space around the operator
|
3 years ago |
AP_NavEKF2
|
AP_NavEKF2: update and correct GSF parameter documentation
|
3 years ago |
AP_NavEKF3
|
AP_NavEKF3: fixed constrain indexing bug
|
3 years ago |
AP_Navigation
|
AP_Navigation: make crosstrack_error_integrator pure virtual as nobody use the base class
|
4 years ago |
AP_Notify
|
AP_Notify: fixed DroneCAN LEDs on AP_Periph
|
3 years ago |
AP_OLC
|
…
|
|
AP_ONVIF
|
AP_ONVIF: use correct #pragma GCC diagnostic pop
|
3 years ago |
AP_OSD
|
AP_OSD: rename AP_AHRS::get_position to get_location
|
3 years ago |
AP_OpticalFlow
|
AP_OpticalFlow: Change division to multiplication
|
3 years ago |
AP_Parachute
|
AP_Parachute: added arming check for chute released
|
3 years ago |
AP_Param
|
Revert "AP_Param: Use AP:FS() to read files"
|
3 years ago |
AP_PiccoloCAN
|
AP_PiccoloCAN: GPIO servo does not count as active
|
3 years ago |
AP_Proximity
|
AP_Proximity: nuke clang warnings
|
3 years ago |
AP_RAMTRON
|
…
|
|
AP_RCMapper
|
…
|
|
AP_RCProtocol
|
Revert "AP_RCProtocol: change default SBUS frame gap to 4ms"
|
3 years ago |
AP_RCTelemetry
|
AP_RCTelemetry: add define AP_AIRSPEED_ENABLED
|
3 years ago |
AP_ROMFS
|
…
|
|
AP_RPM
|
AP_RPM: move RPM sensor logging into AP_RPM
|
3 years ago |
AP_RSSI
|
AP_RSSI : Update Telemetry
|
3 years ago |
AP_RTC
|
AP_RTC: fix oldest_acceptable_date to be in micros
|
3 years ago |
AP_Radio
|
AP_Radio: include cleanups
|
3 years ago |
AP_Rally
|
AP_Rally: convert APM_BUILD_COPTER_OR_HELI() to APM_BUILD_COPTER_OR_HELI
|
3 years ago |
AP_RangeFinder
|
AP_RangeFinder: add build option for Rangefinders
|
3 years ago |
AP_Relay
|
AP_Relay: update param description to inclde IOMCU
|
3 years ago |
AP_RobotisServo
|
AP_RobotisServo: Move crc16-ibm CRC calculation method to a common class
|
3 years ago |
AP_SBusOut
|
…
|
|
AP_Scheduler
|
AP_Scheduler: allow 9999us for task display
|
3 years ago |
AP_Scripting
|
AP_Scripting: plane ship landing script
|
3 years ago |
AP_SerialLED
|
AP_SerialLED: removed empty constructors
|
3 years ago |
AP_SerialManager
|
AP_SerialManager: Add support for High Latency MAVLink protocol
|
3 years ago |
AP_ServoRelayEvents
|
…
|
|
AP_SmartRTL
|
AP_SmartRTL: rename for AHRS restructuring
|
4 years ago |
AP_Soaring
|
AP_Soaring: Remove meaningless semicolons
|
3 years ago |
AP_Stats
|
…
|
|
AP_TECS
|
AP_TECS: add reset throttle I function
|
3 years ago |
AP_TempCalibration
|
…
|
|
AP_TemperatureSensor
|
…
|
|
AP_Terrain
|
AP_Terrain: removed terrain home correction
|
3 years ago |
AP_Torqeedo
|
AP_Torqeedo: simplify conversion of master error code into string
|
3 years ago |
AP_ToshibaCAN
|
AP_ToshibaCAN: correct spelling mili -> milli
|
3 years ago |
AP_Tuning
|
AP_Tuning: removed controller error messages
|
3 years ago |
AP_UAVCAN
|
AP_UAVCAN: add metadata to GetNodeInfo log message
|
3 years ago |
AP_Vehicle
|
AP_Vehicle: added update_target_location()
|
3 years ago |
AP_VideoTX
|
AP_VideoTX : fixed typo
|
3 years ago |
AP_VisualOdom
|
AP_VisualOdom: added VOXL backend type
|
3 years ago |
AP_Volz_Protocol
|
AP_Volz_Protocol: include cleanups
|
3 years ago |
AP_WheelEncoder
|
AP_WheelEncoder: quadrature spelling changed
|
3 years ago |
AP_Winch
|
AP_Winch: use floats for get/set output scaled
|
3 years ago |
AP_WindVane
|
AP_WindVane: include cleanups
|
3 years ago |
AR_Motors
|
AR_Motors: remove redundant set of throttle limit flags
|
3 years ago |
AR_WPNav
|
AR_WPNav: rename AP_AHRS::get_position to get_location
|
3 years ago |
Filter
|
Filter: add trivial test for ModeFilter get method (float version)
|
3 years ago |
GCS_MAVLink
|
GCS_MAVLink: Add support for High Latency MAVLink protocol
|
3 years ago |
PID
|
…
|
|
RC_Channel
|
RC_Channel: rename within_min_dz to in_min_dz for consistency
|
3 years ago |
SITL
|
SITL: added ship offset and ATTITUDE
|
3 years ago |
SRV_Channel
|
SRV_Channel: Changing servo functions are now reboot required
|
3 years ago |
StorageManager
|
StorageManager: fix write_block() comment
|
3 years ago |
doc
|
…
|
|