..
AC_PID
AC_PID - added more paranoid checking that imax is positive in constructor, operator() and load_gains methods
13 years ago
APM_PI
added indexes to group info structures
13 years ago
APM_RC
APM_RC: added OutputCh_current() method
13 years ago
APO
Added camera trigger functionality
13 years ago
AP_ADC
ADC: added suspend/resume on init
13 years ago
AP_AHRS
AHRS: fixed HIL build
13 years ago
AP_AnalogSource
AP_AnalogSource_Arduino: fix to allow analog port to be read to be specified as a "channel" (i.e. A0)
13 years ago
AP_Baro
AP_Baro: improved barometer averaging
13 years ago
AP_Camera
AP_Camera: moved seme constructor initialisers around to remove compile warnings
13 years ago
AP_Common
AP_Param: added some docs on the eeprom header format
13 years ago
AP_Compass
Compass: remove the need to call calculate() on the compass object
13 years ago
AP_Declination
AP_Declination: save some more memory by putting the declination keys in progmem
13 years ago
AP_EEPROMB
Arduino 1.0 - changed all #includes of "WProgram.h", "wiring.h" and "WConstants.h to "Arduino.h".
13 years ago
AP_GPS
GPS: test the more modern MTK16
13 years ago
AP_IMU
Spellcheck
13 years ago
AP_InertialSensor
MPU6k: removed an unused variable
13 years ago
AP_LeadFilter
Added a crude Lead Filter. Needs some fine tuning, lag specification, scaling. Works great on 4hz GPS such as Mtek.
13 years ago
AP_Math
AP_Math: added get_distance_cm() to return in centimeters
13 years ago
AP_Motors
Instituting Yaw Differential on Multirotors. Intent is to stop "rise on yaw input".
13 years ago
AP_Mount
AP_Mount: add support for non-spring-loaded joysticks
13 years ago
AP_Navigation
Arduino 1.0 - changed all #includes of "WProgram.h", "wiring.h" and "WConstants.h to "Arduino.h".
13 years ago
AP_OpticalFlow
AP_OpticalFlow - updated test sketch to allow testing of APM2 version
13 years ago
AP_PID
AP_PID, AP_RC_Channel, FastSerial - small changes to make example sketches compile again
13 years ago
AP_PeriodicProcess
AnalogSource: make the Arduino AnalogSource interrupt driven
13 years ago
AP_RC_Channel
Added support for channel curves (and expo) to AP_RC_Channel class. Also updated AP_RC_Channel example/test to demonstrate and test new functionality
13 years ago
AP_RangeFinder
Added Michael Pursifull's Maxsonar HRLV model support
13 years ago
AP_Relay
Arduino 1.0 - changed all #includes of "WProgram.h", "wiring.h" and "WConstants.h to "Arduino.h".
13 years ago
AP_Var
move AP_Var code and example into libraries/AP_Var
13 years ago
Arduino_Mega_ISR_Registry
purple: added ISR_Registry() library
13 years ago
DataFlash
DataFlash: The current method for checking if chip erase worked is producing false positives. We are forcing the block erase until we have a deterministic test method.
13 years ago
Desktop
SITL: run the HIL barometer at 80Hz to match APM2
13 years ago
FastSerial
FastSerial: added tx_pending() method
13 years ago
Filter
Filter: split the DerivativeFilter steps into update() and slope()
13 years ago
GCS_MAVLink
MAVLink: remove MAVLink 0.9 protocol support
13 years ago
GPS_IMU/examples/ GPS_IMU_test
libs: removed unused library GPS_IMU
13 years ago
I2C
I2C: fixed cr/lf mess
13 years ago
PID
APM: changed PID library to do automatic deltat calculation
13 years ago
RC_Channel
AP_Mount: add support for non-spring-loaded joysticks
13 years ago
SITL
SITL: lower baro noise a bit
13 years ago
Trig_LUT
Optional recursion added.
14 years ago
Waypoints
Arduino 1.0 - changed all #includes of "WProgram.h", "wiring.h" and "WConstants.h to "Arduino.h".
13 years ago
doc
Checking these in makes the libraries too bulky. We need to host them somewhere.
14 years ago
memcheck
memcheck: allow memcheck to build on desktop systems
14 years ago