You can not select more than 25 topics Topics must start with a letter or number, can include dashes ('-') and can be up to 35 characters long.
 
 
 
 
 
 
Peter Barker 3749cfd764 GCS_MAVLink: allow vehicles to override VFR_HUD.alt 6 years ago
..
AC_AttitudeControl AC_AttitudeControl: Change from sqrt to safe_sqrt 6 years ago
AC_Avoidance AC_Avoid: add singleton 6 years ago
AC_Fence AC_Fence: do not enable altitude fence on Rover by default 6 years ago
AC_InputManager
AC_PID AC_PID: Fix D term initialisation 6 years ago
AC_PrecLand AC_PrecLand: init accepts update rate 6 years ago
AC_Sprayer AC_Sprayer: add singleton 7 years ago
AC_WPNav AC_WPNav: add reached_wp_destination_xy 6 years ago
APM_Control APM_Control: correct use of incorrect abs functions 6 years ago
AP_ADC AP_ADC: Remove unused AP_ADC class 7 years ago
AP_ADSB AP_ADSB: Add valid parameter range to squawk codes 7 years ago
AP_AHRS AP_AHRS: Suppress clearing non-trival type warning 6 years ago
AP_AccelCal AP_AccelCal: use mavlink define for field length 6 years ago
AP_AdvancedFailsafe Copter: correct AFS terminate-via-land for Copter 6 years ago
AP_Airspeed AP_Airspeed: use WITH_SEMAPHORE() 6 years ago
AP_Arming AP_Arming: account for snprintf now null-terminating strings 6 years ago
AP_Avoidance AP_Avoidance: added semaphore 7 years ago
AP_BLHeli AP_BLHeli: correct SERVO_BLH_POLES parameter value range metadata 6 years ago
AP_Baro AP_Baro: use WITH_SEMAPHORE() 6 years ago
AP_BattMonitor AP_BattMonitor: added BATT_MONITOR_DEFAULT option 6 years ago
AP_Beacon AP_Beacon: Use SITL singleton 7 years ago
AP_BoardConfig AP_BoardConfig: updated BRD_PWM_COUNT docs 6 years ago
AP_Buffer
AP_Button
AP_Camera AP_Camera: Adding ability to control the Black Magic Micro Cinema Camera 6 years ago
AP_Common AP_Common: Bitmask: remove copy operator and constructor 6 years ago
AP_Compass AP_Compass: Increase default MAX compass offset 6 years ago
AP_Declination AP_Declination: Fixes ups for pyigrf 7 years ago
AP_Devo_Telem AP_Devo_Telem: fixed to check for have_position 7 years ago
AP_FlashStorage AP_FlashStorage: adjust example so it does not exit 6 years ago
AP_Follow AP_Follow: fixup offset initialisation 7 years ago
AP_Frsky_Telem AP_Frsky_Telem: use mavlink definition to get statustext size 6 years ago
AP_GPS AP_GPS: Suppress clearing non-trival type warning 6 years ago
AP_Gripper AP_Gripper: stop cheating on simulated servo state 6 years ago
AP_HAL AP_HAL: set default batt monitoring for bebop and disco 6 years ago
AP_HAL_AVR
AP_HAL_ChibiOS HAL_ChibiOS: added Omnibusf4v6 board, based on omnibusnanov6. 6 years ago
AP_HAL_Empty HAL_Empty: fix ambiguity of UARTDriver with the one defined in ChibiOS 6 years ago
AP_HAL_F4Light HAL_F4Light: removed hal.util->new_semaphore() 6 years ago
AP_HAL_FLYMAPLE
AP_HAL_Linux HAL_Linux: removed hal.util->new_semaphore() 6 years ago
AP_HAL_PX4 AP_HAL_PX4: return uart link bandwidth 6 years ago
AP_HAL_SITL HAL_SITL: increase max timer procs 6 years ago
AP_HAL_VRBRAIN HAL_VRBRAIN: removed hal.util->new_semaphore() 6 years ago
AP_ICEngine AP_ICEngine: use rc() method to get rc singleton 7 years ago
AP_IOMCU AP_IOMCU: fixed a race in event trigger on startup 6 years ago
AP_IRLock AP_IRLock: use WITH_SEMAPHORE() 6 years ago
AP_InertialNav AP_InertialNav: remove dead get_hagl method 7 years ago
AP_InertialSensor AP_InertialSensor: use WITH_SEMAPHORE() 6 years ago
AP_JSButton AP_JSButton: Add servo toggle button function 7 years ago
AP_L1_Control AP_L1_Control: lower default L1 period 7 years ago
AP_Landing AP_Landing: Fix misspelling in deepstall docs 7 years ago
AP_LandingGear AP_LANDING_GEAR: Remove deploy lock 7 years ago
AP_LeakDetector
AP_Math AP_Math: correct compilation when running MATH_CHECK_INDEXES 6 years ago
AP_Menu
AP_Mission AP_Mission: return true if cmd-do was handled, false otherwise 6 years ago
AP_Module AP_Module: Remove unused ADC include 7 years ago
AP_Motors AP_Motors: handle boost in spool up and down the same way 6 years ago
AP_Mount AP_Mount: SoloGimbal: avoid calling safe_sqrtf 6 years ago
AP_NavEKF AP_NavEKF: added gps_quality_good EKF flag 7 years ago
AP_NavEKF2 AP_NavEKF2: Suppress clearing non-trival type warning 6 years ago
AP_NavEKF3 AP_NavEKF3: Suppress clearing non-trival type warning 6 years ago
AP_Navigation AP_L1_Control: update_waypoint gets dist_min argument 7 years ago
AP_Notify AP_Notify: use WITH_SEMAPHORE() 6 years ago
AP_OSD AP_OSD: add include for WITH_SEMAPHORE 6 years ago
AP_OpticalFlow AP_OpticalFlow: No need to clear already zerod objects 6 years ago
AP_Parachute AP_Parachute: remove un-needed initialisations 7 years ago
AP_Param AP_Param: use background parameter save 7 years ago
AP_Param_Helper AP_Param_Helper: HAL_F4Light parameters divided into common and board specific 7 years ago
AP_Proximity AP_Proximity: increase MAV driver timeout to 500ms 6 years ago
AP_RAMTRON AP_RAMTRON: use WITH_SEMAPHORE() 6 years ago
AP_RCMapper AP_RCMapper: Mark sub specific parameters as sub only for docs 7 years ago
AP_RCProtocol AP_RCProtocol: fixed coverity error in SUMD 7 years ago
AP_ROMFS AP_ROMFS: make all decompressions null terminated 6 years ago
AP_RPM AP_RPM: treat RPM_TYPE 1 as type 2 on non-PX4 6 years ago
AP_RSSI AP_RSSI: fixed build warnings 6 years ago
AP_RTC AP_RTC: Delete unused variables 6 years ago
AP_Radio AP_Radio: use WITH_SEMAPHORE() 6 years ago
AP_Rally AP_Rally: rover includes home by default 7 years ago
AP_RangeFinder AP_RangeFinder: Benewake driver discards distances over 327m 6 years ago
AP_Relay AP_Relay: Remove APM doc references 7 years ago
AP_SBusOut AP_SbusOut: expose SBUS formatting function 6 years ago
AP_Scheduler AP_Scheduler: use AP_FWVersion singleton 7 years ago
AP_Scripting AP_Scripting: Add access to SRV_Channels::set_output_pwm 6 years ago
AP_SerialManager AP_SerialManager: make console do mavlink2 by default 7 years ago
AP_ServoRelayEvents AP_ServoRelayEvents: More robust check if a channel is available 7 years ago
AP_SmartRTL AP_SmartRTL: stop constructing/copying Bitmask 6 years ago
AP_Soaring AP_Soaring: const some accessors 7 years ago
AP_SpdHgtControl AP_SpdHgtControl: update API for TECS change 7 years ago
AP_Stats AP_Stats: make singleton and add flighttime accessor 7 years ago
AP_TECS AP_TECS: set default pitch max to 15 7 years ago
AP_TempCalibration AP_TempCalibration: remove duplicated parameter 7 years ago
AP_TemperatureSensor AP_TemperatureSensor: remove pointless constructor 7 years ago
AP_Terrain AP_Terrain: Reduce memory consumption, simplify enable checking 7 years ago
AP_Tuning AP_Tuning: use rc() method to get rc singleton 7 years ago
AP_UAVCAN AP_UAVCAN: use WITH_SEMAPHORE() 6 years ago
AP_Vehicle
AP_VisualOdom
AP_Volz_Protocol AP_Volz_Protocol: fixed build warnings 6 years ago
AP_WheelEncoder AP_WheelEncder: remove dead code 6 years ago
AP_Winch AP_Winch: undefine PASS_TO_BACKEND convenience function 7 years ago
AP_WindVane AP_WindVane: rename variables and parameters 6 years ago
DataFlash DataFlash: add sanity checks around EraseAll 6 years ago
Filter
GCS_MAVLink GCS_MAVLink: allow vehicles to override VFR_HUD.alt 6 years ago
PID PID: Remove examples/keywords 7 years ago
RC_Channel RC_Channel: add Sailboat Tack to aux switch 6 years ago
SITL SITL: correct comment on sending gimbal messages 6 years ago
SRV_Channel SRV_Channel: Add scripting outputs 6 years ago
StorageManager StorageManager: allow for 15k storage 7 years ago
doc