..
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 - moved Force_Out0_Out1, Force_Out2_Out3 and Force_Out6_Out6 to APM_RC parent class because it's already implemented in the APM1 and APM2 child classes anyway
13 years ago
APO
change constant to float 44330.0
13 years ago
AP_ADC
ADC: minor fix to the ADC Ch6() code
13 years ago
AP_AHRS
DCM: buffer omega_I changes over 10 seconds
13 years ago
AP_AnalogSource
Arduino 1.0 - changed all #includes of "WProgram.h", "wiring.h" and "WConstants.h to "Arduino.h".
13 years ago
AP_Baro
AP_Baro - change data type size of temperature's average filter to int32_t (was int16_t)
13 years ago
AP_Common
correct small typos in comments
13 years ago
AP_Compass
AP_Compass - changed parameter initialisation order to remove compiler warning
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: u-center config file for 3DR Ublox
13 years ago
AP_IMU
IMU: added get_gyro_drift_rate() interface
13 years ago
AP_InertialSensor
InertialSensor: fixed HIL build
13 years ago
AP_Math
examples: fixed build of some examples with new AP_Declination code
13 years ago
AP_Motors
AP_Motors - allow tail servo to be reversed. Closes ArduCopter issue #228
13 years ago
AP_Mount
AP_Mount: adapt library for AHRS framework
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
Arduino 1.0 - changed all #includes of "WProgram.h", "wiring.h" and "WConstants.h to "Arduino.h".
13 years ago
AP_RC_Channel
AP_PID, AP_RC_Channel, FastSerial - small changes to make example sketches compile again
13 years ago
AP_RangeFinder
AP_RangeFinder - changed example sketch to work with new Filter library
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_APM2 - moved CS_inactive call (which disables the dataflash) from the beginning to the end of all methods. This means the dataflash does not monopolize the SPI bus.
13 years ago
Desktop
SITL: add magnetic field noise to the simulated compass
13 years ago
FastSerial
FastSerial: added set_blocking_writes() interface
13 years ago
Filter
Filter - added FilterWithBuffer typedefs for int32t and uint32 for ease of use
13 years ago
GCS_MAVLink
MAVLink update to 1.0.7
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
fixed imax load/save in PID
13 years ago
RC_Channel
RC_Channel - fixed small compiler warning
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