2 * This file is part of Cleanflight.
4 * Cleanflight is free software: you can redistribute it and/or modify
5 * it under the terms of the GNU General Public License as published by
6 * the Free Software Foundation, either version 3 of the License, or
7 * (at your option) any later version.
9 * Cleanflight is distributed in the hope that it will be useful,
10 * but WITHOUT ANY WARRANTY; without even the implied warranty of
11 * MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
12 * GNU General Public License for more details.
14 * You should have received a copy of the GNU General Public License
15 * along with Cleanflight. If not, see <http://www.gnu.org/licenses/>.
18 // Inertial Measurement Unit (IMU)
25 #include "common/maths.h"
26 #include "common/filter.h"
31 #include "common/axis.h"
33 #include "drivers/system.h"
34 #include "drivers/sensor.h"
35 #include "drivers/accgyro.h"
36 #include "drivers/compass.h"
38 #include "sensors/sensors.h"
39 #include "sensors/gyro.h"
40 #include "sensors/compass.h"
41 #include "sensors/acceleration.h"
42 #include "sensors/barometer.h"
43 #include "sensors/sonar.h"
45 #include "flight/mixer.h"
46 #include "flight/pid.h"
47 #include "flight/imu.h"
51 #include "config/runtime_config.h"
53 // the limit (in degrees/second) beyond which we stop integrating
54 // omega_I. At larger spin rates the DCM PI controller can get 'dizzy'
55 // which results in false gyro drift. See
56 // http://gentlenav.googlecode.com/files/fastRotations.pdf
57 #define SPIN_RATE_LIMIT 20
59 int16_t accSmooth
[XYZ_AXIS_COUNT
];
60 int32_t accSum
[XYZ_AXIS_COUNT
];
62 uint32_t accTimeSum
= 0; // keep track for integration of acc
67 float throttleAngleScale
;
68 float smallAngleCosZ
= 0;
70 float magneticDeclination
= 0.0f
; // calculated at startup from config
72 static imuRuntimeConfig_t
*imuRuntimeConfig
;
73 static pidProfile_t
*pidProfile
;
74 static accDeadband_t
*accDeadband
;
77 static float q0
= 1.0f
, q1
= 0.0f
, q2
= 0.0f
, q3
= 0.0f
; // quaternion of sensor frame relative to earth frame
78 static float rMat
[3][3];
80 attitudeEulerAngles_t attitude
= { { 0, 0, 0 } }; // absolute angle inclination in multiple of 0.1 degree 180 deg = 1800
82 static float gyroScale
;
84 static void imuCompureRotationMatrix(void)
97 rMat
[0][0] = 1.0f
- 2.0f
* q2q2
- 2.0f
* q3q3
;
98 rMat
[0][1] = 2.0f
* (q1q2
+ -q0q3
);
99 rMat
[0][2] = 2.0f
* (q1q3
- -q0q2
);
101 rMat
[1][0] = 2.0f
* (q1q2
- -q0q3
);
102 rMat
[1][1] = 1.0f
- 2.0f
* q1q1
- 2.0f
* q3q3
;
103 rMat
[1][2] = 2.0f
* (q2q3
+ -q0q1
);
105 rMat
[2][0] = 2.0f
* (q1q3
+ -q0q2
);
106 rMat
[2][1] = 2.0f
* (q2q3
- -q0q1
);
107 rMat
[2][2] = 1.0f
- 2.0f
* q1q1
- 2.0f
* q2q2
;
111 imuRuntimeConfig_t
*initialImuRuntimeConfig
,
112 pidProfile_t
*initialPidProfile
,
113 accDeadband_t
*initialAccDeadband
,
114 float accz_lpf_cutoff
,
115 uint16_t throttle_correction_angle
118 imuRuntimeConfig
= initialImuRuntimeConfig
;
119 pidProfile
= initialPidProfile
;
120 accDeadband
= initialAccDeadband
;
121 fc_acc
= calculateAccZLowPassFilterRCTimeConstant(accz_lpf_cutoff
);
122 throttleAngleScale
= calculateThrottleAngleScale(throttle_correction_angle
);
127 smallAngleCosZ
= cos_approx(degreesToRadians(imuRuntimeConfig
->small_angle
));
128 gyroScale
= gyro
.scale
* (M_PIf
/ 180.0f
); // gyro output scaled to rad per second
129 accVelScale
= 9.80665f
/ acc_1G
/ 10000.0f
;
131 imuCompureRotationMatrix();
134 float calculateThrottleAngleScale(uint16_t throttle_correction_angle
)
136 return (1800.0f
/ M_PIf
) * (900.0f
/ throttle_correction_angle
);
140 * Calculate RC time constant used in the accZ lpf.
142 float calculateAccZLowPassFilterRCTimeConstant(float accz_lpf_cutoff
)
144 return 0.5f
/ (M_PIf
* accz_lpf_cutoff
);
147 void imuResetAccelerationSum(void)
156 void imuTransformVectorBodyToEarth(t_fp_vector
* v
)
160 /* From body frame to earth frame */
161 x
= rMat
[0][0] * v
->V
.X
+ rMat
[0][1] * v
->V
.Y
+ rMat
[0][2] * v
->V
.Z
;
162 y
= rMat
[1][0] * v
->V
.X
+ rMat
[1][1] * v
->V
.Y
+ rMat
[1][2] * v
->V
.Z
;
163 z
= rMat
[2][0] * v
->V
.X
+ rMat
[2][1] * v
->V
.Y
+ rMat
[2][2] * v
->V
.Z
;
170 // rotate acc into Earth frame and calculate acceleration in it
171 void imuCalculateAcceleration(uint32_t deltaT
)
173 static int32_t accZoffset
= 0;
174 static float accz_smooth
= 0;
176 t_fp_vector accel_ned
;
178 // deltaT is measured in us ticks
179 dT
= (float)deltaT
* 1e-6f
;
181 accel_ned
.V
.X
= accSmooth
[0];
182 accel_ned
.V
.Y
= accSmooth
[1];
183 accel_ned
.V
.Z
= accSmooth
[2];
185 imuTransformVectorBodyToEarth(&accel_ned
);
187 if (imuRuntimeConfig
->acc_unarmedcal
== 1) {
188 if (!ARMING_FLAG(ARMED
)) {
189 accZoffset
-= accZoffset
/ 64;
190 accZoffset
+= accel_ned
.V
.Z
;
192 accel_ned
.V
.Z
-= accZoffset
/ 64; // compensate for gravitation on z-axis
194 accel_ned
.V
.Z
-= acc_1G
;
196 accz_smooth
= accz_smooth
+ (dT
/ (fc_acc
+ dT
)) * (accel_ned
.V
.Z
- accz_smooth
); // low pass filter
198 // apply Deadband to reduce integration drift and vibration influence
199 accSum
[X
] += applyDeadband(lrintf(accel_ned
.V
.X
), accDeadband
->xy
);
200 accSum
[Y
] += applyDeadband(lrintf(accel_ned
.V
.Y
), accDeadband
->xy
);
201 accSum
[Z
] += applyDeadband(lrintf(accz_smooth
), accDeadband
->z
);
203 // sum up Values for later integration to get velocity and distance
204 accTimeSum
+= deltaT
;
208 static float invSqrt(float x
)
210 return 1.0f
/ sqrtf(x
);
213 static bool imuUseFastGains(void)
215 return !ARMING_FLAG(ARMED
) && millis() < 20000;
218 // Taken from http://gentlenav.googlecode.com/files/fastRotations.pdf
219 static float imuGetPGainScaleFactor(float spin_rate
)
221 if (spin_rate
< DEGREES_TO_RADIANS(50)) {
224 else if (spin_rate
> DEGREES_TO_RADIANS(500)) {
228 return spin_rate
/ DEGREES_TO_RADIANS(50);
231 static void imuMahonyAHRSupdate(float dt
, float gx
, float gy
, float gz
,
232 bool useAcc
, float ax
, float ay
, float az
,
233 bool useMag
, float mx
, float my
, float mz
,
234 bool useYaw
, float yawError
)
236 static float integralFBx
= 0.0f
, integralFBy
= 0.0f
, integralFBz
= 0.0f
; // integral error terms scaled by Ki
239 float ex
= 0, ey
= 0, ez
= 0;
242 // Calculate general spin rate (rad/s)
243 float spin_rate
= sqrtf(sq(gx
) + sq(gy
) + sq(gz
));
245 // Use raw heading error (from GPS or whatever else)
247 while (yawError
> M_PIf
) yawError
-= (2.0f
* M_PIf
);
248 while (yawError
< -M_PIf
) yawError
+= (2.0f
* M_PIf
);
250 ez
+= sin_approx(yawError
/ 2.0f
);
253 // Use measured magnetic field vector
254 recipNorm
= mx
* mx
+ my
* my
+ mz
* mz
;
255 if (useMag
&& recipNorm
> 0.01f
) {
256 // Normalise magnetometer measurement
257 recipNorm
= invSqrt(recipNorm
);
262 // For magnetometer correction we make an assumption that magnetic field is perpendicular to gravity (ignore Z-component in EF).
263 // This way magnetic field will only affect heading and wont mess roll/pitch angles
265 // (hx; hy; 0) - measured mag field vector in EF (assuming Z-component is zero)
266 // (bx; 0; 0) - reference mag field vector heading due North in EF (assuming Z-component is zero)
267 hx
= rMat
[0][0] * mx
+ rMat
[0][1] * my
+ rMat
[0][2] * mz
;
268 hy
= rMat
[1][0] * mx
+ rMat
[1][1] * my
+ rMat
[1][2] * mz
;
269 bx
= sqrtf(hx
* hx
+ hy
* hy
);
271 // magnetometer error is cross product between estimated magnetic north and measured magnetic north (calculated in EF)
272 float ez_ef
= -(hy
* bx
);
274 // Rotate mag error vector back to BF and accumulate
275 ex
+= rMat
[2][0] * ez_ef
;
276 ey
+= rMat
[2][1] * ez_ef
;
277 ez
+= rMat
[2][2] * ez_ef
;
280 // Use measured acceleration vector
281 recipNorm
= ax
* ax
+ ay
* ay
+ az
* az
;
282 if (useAcc
&& recipNorm
> 0.01f
) {
283 // Normalise accelerometer measurement
284 recipNorm
= invSqrt(recipNorm
);
289 // Error is sum of cross product between estimated direction and measured direction of gravity
290 ex
+= (ay
* rMat
[2][2] - az
* rMat
[2][1]);
291 ey
+= (az
* rMat
[2][0] - ax
* rMat
[2][2]);
292 ez
+= (ax
* rMat
[2][1] - ay
* rMat
[2][0]);
295 // Compute and apply integral feedback if enabled
296 if(imuRuntimeConfig
->dcm_ki
> 0.0f
) {
297 // Stop integrating if spinning beyond the certain limit
298 if (spin_rate
< DEGREES_TO_RADIANS(SPIN_RATE_LIMIT
)) {
299 float dcmKiGain
= imuRuntimeConfig
->dcm_ki
;
300 integralFBx
+= dcmKiGain
* ex
* dt
; // integral error scaled by Ki
301 integralFBy
+= dcmKiGain
* ey
* dt
;
302 integralFBz
+= dcmKiGain
* ez
* dt
;
306 integralFBx
= 0.0f
; // prevent integral windup
311 // Calculate kP gain. If we are acquiring initial attitude (not armed and within 20 sec from powerup) scale the kP to converge faster
312 float dcmKpGain
= imuRuntimeConfig
->dcm_kp
;
313 if (imuUseFastGains()) {
317 dcmKpGain
*= imuGetPGainScaleFactor(spin_rate
);
320 // Apply proportional and integral feedback
321 gx
+= dcmKpGain
* ex
+ integralFBx
;
322 gy
+= dcmKpGain
* ey
+ integralFBy
;
323 gz
+= dcmKpGain
* ez
+ integralFBz
;
325 // Integrate rate of change of quaternion
333 q0
+= (-qb
* gx
- qc
* gy
- q3
* gz
);
334 q1
+= (qa
* gx
+ qc
* gz
- q3
* gy
);
335 q2
+= (qa
* gy
- qb
* gz
+ q3
* gx
);
336 q3
+= (qa
* gz
+ qb
* gy
- qc
* gx
);
338 // Normalise quaternion
339 recipNorm
= invSqrt(q0
* q0
+ q1
* q1
+ q2
* q2
+ q3
* q3
);
345 // Pre-compute rotation matrix from quaternion
346 imuCompureRotationMatrix();
349 static void imuUpdateEulerAngles(void)
351 /* Compute pitch/roll angles */
352 attitude
.values
.roll
= lrintf(atan2f(rMat
[2][1], rMat
[2][2]) * (1800.0f
/ M_PIf
));
353 attitude
.values
.pitch
= lrintf(((0.5f
* M_PIf
) - acosf(-rMat
[2][0])) * (1800.0f
/ M_PIf
));
354 attitude
.values
.yaw
= lrintf((-atan2f(rMat
[1][0], rMat
[0][0]) * (1800.0f
/ M_PIf
) + magneticDeclination
));
356 if (attitude
.values
.yaw
< 0)
357 attitude
.values
.yaw
+= 3600;
359 /* Update small angle state */
360 if (rMat
[2][2] > smallAngleCosZ
) {
361 ENABLE_STATE(SMALL_ANGLE
);
363 DISABLE_STATE(SMALL_ANGLE
);
367 static bool imuIsAccelerometerHealthy(void)
370 int32_t accMagnitude
= 0;
372 for (axis
= 0; axis
< 3; axis
++) {
373 accMagnitude
+= (int32_t)accSmooth
[axis
] * accSmooth
[axis
];
376 accMagnitude
= accMagnitude
* 100 / ((int32_t)acc_1G
* acc_1G
);
378 // Accept accel readings only in range 0.90g - 1.10g
379 return (81 < accMagnitude
) && (accMagnitude
< 121);
382 static bool isMagnetometerHealthy(void)
384 return (magADC
[X
] != 0) && (magADC
[Y
] != 0) && (magADC
[Z
] != 0);
387 static void imuCalculateEstimatedAttitude(void)
389 static filterStatePt1_t accLPFState
[3];
390 static uint32_t previousIMUUpdateTime
;
391 float rawYawError
= 0;
397 uint32_t currentTime
= micros();
398 uint32_t deltaT
= currentTime
- previousIMUUpdateTime
;
399 previousIMUUpdateTime
= currentTime
;
401 // If reading is considered valid - apply filter
402 for (axis
= 0; axis
< 3; axis
++) {
403 if (imuRuntimeConfig
->acc_cut_hz
> 0) {
404 accSmooth
[axis
] = filterApplyPt1(accADC
[axis
], &accLPFState
[axis
], imuRuntimeConfig
->acc_cut_hz
, deltaT
* 1e-6);
406 accSmooth
[axis
] = accADC
[axis
];
410 // Smooth and use only valid accelerometer readings
411 if (imuIsAccelerometerHealthy()) {
415 if (sensors(SENSOR_MAG
) && isMagnetometerHealthy()) {
419 else if (STATE(FIXED_WING
) && sensors(SENSOR_GPS
) && STATE(GPS_FIX
) && GPS_numSat
>= 5 && GPS_speed
>= 300) {
420 // In case of a fixed-wing aircraft we can use GPS course over ground to correct heading
421 rawYawError
= DECIDEGREES_TO_RADIANS(GPS_ground_course
- attitude
.values
.yaw
);
426 imuMahonyAHRSupdate(deltaT
* 1e-6f
,
427 gyroADC
[X
] * gyroScale
, gyroADC
[Y
] * gyroScale
, gyroADC
[Z
] * gyroScale
,
428 useAcc
, accSmooth
[X
], accSmooth
[Y
], accSmooth
[Z
],
429 useMag
, magADC
[X
], magADC
[Y
], magADC
[Z
],
430 useYaw
, rawYawError
);
432 imuUpdateEulerAngles();
434 imuCalculateAcceleration(deltaT
); // rotate acc vector into earth frame
437 void imuUpdate(rollAndPitchTrims_t
*accelerometerTrims
, uint8_t imuUpdateSensors
)
439 if (imuUpdateSensors
== ONLY_GYRO
|| imuUpdateSensors
== ACC_AND_GYRO
) {
442 if (sensors(SENSOR_ACC
) && (!imuUpdateSensors
== ONLY_GYRO
)) {
443 updateAccelerationReadings(accelerometerTrims
);
444 imuCalculateEstimatedAttitude();
452 int16_t calculateThrottleAngleCorrection(uint8_t throttle_correction_value
)
455 * Use 0 as the throttle angle correction if we are inverted, vertical or with a
456 * small angle < 0.86 deg
457 * TODO: Define this small angle in config.
459 if (rMat
[2][2] <= 0.015f
) {
462 int angle
= lrintf(acosf(rMat
[2][2]) * throttleAngleScale
);
465 return lrintf(throttle_correction_value
* sin_approx(angle
/ (900.0f
* M_PIf
/ 2.0f
)));