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.
 
 
 
 
 
 
Víctor Mayoral Vilches eb95130441 AP_InertialSensor_MPU9250: remove legacy CS. 11 years ago
..
AC_AttitudeControl AC_AttitudeControl: Limit _pos_target.z to below alt_max before computing error 11 years ago
AC_Fence AC_Fence: add 10sec manual recovery 11 years ago
AC_PID AC_HELI_PID: Add feedforward accessor functions. 11 years ago
AC_Sprayer AC_Sprayer: fix example sketch 11 years ago
AC_WPNav AC_WPNav: update yaw only when track is at least 2m 11 years ago
APM_Control APM_Control: avoid some float conversion warnings 11 years ago
APM_OBC APM_OBC: fixed formatting to match APM coding standard 11 years ago
APM_PI
AP_ADC AP_ADC: fixup line endings 11 years ago
AP_ADC_AnalogSource AP_ADC_AnalogSource: avoid some float conversion warnings 11 years ago
AP_AHRS AP_AHRS: fixed gyro_bias sign, and pre-calculate gyro_estimate for EKF 11 years ago
AP_Airspeed AP_Airspeed: avoid some float conversion warnings 11 years ago
AP_Arming Arming: accept non-const compass in constructor 11 years ago
AP_Baro AP_Baro_MS5611: Fix the test code so that compiles. 11 years ago
AP_BattMonitor VRBRAIN: change default pin for analog input. 11 years ago
AP_BoardConfig VRBRAIN: deleted unnecessary customizations 11 years ago
AP_Buffer
AP_Camera AP_Camera: updates for relay API change 11 years ago
AP_Common AP_Common: added fire cape product ID 11 years ago
AP_Compass Compass: update pixhawk expected device ids 11 years ago
AP_Curve AP_Curve: remove virtual from method declarations 11 years ago
AP_Declination
AP_EPM AP_EPM: fix for HAL_GPIO_* 11 years ago
AP_GPS GPS_UBLOX: fix test to work with AP_HAL_Linux. 11 years ago
AP_HAL HAL_Linux: include readRegistersMultiple in I2CDriver 11 years ago
AP_HAL_AVR HAL_AVR: fixes for HAL_GPIO_ define change 11 years ago
AP_HAL_AVR_SITL SITL: update simulated sonar support 11 years ago
AP_HAL_Empty HAL_Empty: avoid some float conversion warnings 11 years ago
AP_HAL_FLYMAPLE HAL_FLYMAPLE: fix for HAL_GPIO_* 11 years ago
AP_HAL_Linux HAL_Linux: add support for LinuxDigitalSource in AP_HAL_Linux 11 years ago
AP_HAL_PX4 HAL_PX4: avoid some float conversion warnings 11 years ago
AP_HAL_VRBRAIN AP_HAL_VRBRAIN: removed empty lines 11 years ago
AP_InertialNav Inav: use horizontal body frame for accel corrections 11 years ago
AP_InertialSensor AP_InertialSensor_MPU9250: remove legacy CS. 11 years ago
AP_L1_Control AP_L1_Control: implement turn_distance() with turn angle 11 years ago
AP_Limits
AP_Math AP_Math: Comments on WGS coordinate conversions 11 years ago
AP_Menu
AP_Mission AP_Mission: support MAV_CMD_NAV_VELOCITY msg 11 years ago
AP_Motors AP_Motors_test: Adapt to test bench available 11 years ago
AP_Mount Mount: set_mode method made public 11 years ago
AP_NavEKF VRBRAIN: added VRBRAIN to #if 11 years ago
AP_Navigation AP_Navigation: added a turn_distance() method with turn_angle 11 years ago
AP_Notify AP_Notify: added pins for Linux port 11 years ago
AP_OpticalFlow OptFlow: fixup line endings 11 years ago
AP_Parachute Parachute: clear release time when enabled 11 years ago
AP_Param AP_Param: fixup line endings 11 years ago
AP_PerfMon
AP_Progmem
AP_RCMapper AP_RCMapper: Added warning to RCMAP_THROTTLE 11 years ago
AP_Rally AP_Rally: fixed indentation 11 years ago
AP_RangeFinder AP_RangeFinder: trigger a new reading automatically 11 years ago
AP_Relay AP_Relay: fix for HAL_GPIO_* 11 years ago
AP_Scheduler AP_Scheduler: added current_task static 11 years ago
AP_ServoRelayEvents AP_ServoRelayEvents: fixed disabling repeated events on set_servo() 11 years ago
AP_SpdHgtControl AP_SpdHgtControl: added get_target_airspeed() interface 11 years ago
AP_TECS AP_TECS: Parameter TECS_LAND_SPDWGT allows custom landing speed weight. 11 years ago
AP_Vehicle AP_Vehicle: added autotune_level to fixed wing parms 11 years ago
DataFlash DataFlash: save some flash space on APM2 11 years ago
Filter LowPassFilter: make methods non-virtual 11 years ago
GCS_Console GCS_Console: fixed example build 11 years ago
GCS_MAVLink GCS_Mavlink: moved some more mavlink functions to GCS_Common.cpp 11 years ago
PID PID: fixup line endings 11 years ago
RC_Channel RC_Channel: added support for LimitValue settings 11 years ago
SITL SITL: Add compassmot interference 11 years ago
doc