mirror of
https://github.com/betaflight/betaflight.git
synced 2025-07-18 13:55:18 +03:00
Remove flight_imu and flight_common.c's dependencies on the mw.h/board.h
files. Move baro calibration code into sensors_barometer.c. Move other sensor variables into appropriate files.
This commit is contained in:
parent
51f2487cf5
commit
b3430ae1be
7 changed files with 91 additions and 34 deletions
|
@ -1,5 +1,7 @@
|
||||||
#include "board.h"
|
#include <stdbool.h>
|
||||||
#include "mw.h"
|
#include <stdint.h>
|
||||||
|
|
||||||
|
#include "common/axis.h"
|
||||||
|
|
||||||
#include "runtime_config.h"
|
#include "runtime_config.h"
|
||||||
|
|
||||||
|
|
|
@ -1,33 +1,63 @@
|
||||||
#include "board.h"
|
#include <stdbool.h>
|
||||||
#include "mw.h"
|
#include <stdint.h>
|
||||||
|
#include <math.h>
|
||||||
|
|
||||||
#include "common/maths.h"
|
#include "common/maths.h"
|
||||||
|
|
||||||
|
#include "platform.h"
|
||||||
|
//
|
||||||
|
#include "common/axis.h"
|
||||||
|
#include "flight_common.h"
|
||||||
|
//
|
||||||
|
#include "drivers/system_common.h"
|
||||||
|
//
|
||||||
|
#include "sensors_common.h"
|
||||||
#include "sensors_gyro.h"
|
#include "sensors_gyro.h"
|
||||||
#include "sensors_compass.h"
|
#include "sensors_compass.h"
|
||||||
|
#include "sensors_acceleration.h"
|
||||||
|
#include "sensors_barometer.h"
|
||||||
|
|
||||||
|
#include "flight_mixer.h"
|
||||||
|
|
||||||
|
#include "boardalignment.h"
|
||||||
|
#include "battery.h"
|
||||||
|
#include "rx_common.h"
|
||||||
|
#include "drivers/serial_common.h"
|
||||||
|
#include "serial_common.h"
|
||||||
|
#include "failsafe.h"
|
||||||
|
#include "runtime_config.h"
|
||||||
|
#include "config.h"
|
||||||
|
#include "config_storage.h"
|
||||||
|
|
||||||
#include "flight_common.h"
|
|
||||||
|
|
||||||
int16_t gyroADC[XYZ_AXIS_COUNT], accADC[XYZ_AXIS_COUNT], accSmooth[XYZ_AXIS_COUNT];
|
int16_t gyroADC[XYZ_AXIS_COUNT], accADC[XYZ_AXIS_COUNT], accSmooth[XYZ_AXIS_COUNT];
|
||||||
int32_t accSum[XYZ_AXIS_COUNT];
|
int32_t accSum[XYZ_AXIS_COUNT];
|
||||||
|
|
||||||
uint32_t accTimeSum = 0; // keep track for integration of acc
|
uint32_t accTimeSum = 0; // keep track for integration of acc
|
||||||
int accSumCount = 0;
|
int accSumCount = 0;
|
||||||
|
float accVelScale;
|
||||||
|
|
||||||
int16_t smallAngle = 0;
|
int16_t smallAngle = 0;
|
||||||
|
|
||||||
|
int32_t sonarAlt; // to think about the unit
|
||||||
|
int32_t EstAlt; // in cm
|
||||||
|
int32_t AltHold;
|
||||||
|
int32_t errorAltitudeI = 0;
|
||||||
|
|
||||||
|
int32_t vario = 0; // variometer in cm/s
|
||||||
|
|
||||||
|
int16_t throttleAngleCorrection = 0; // correction of throttle in lateral wind,
|
||||||
|
float throttleAngleScale;
|
||||||
|
|
||||||
|
uint16_t calibratingB = 0; // baro calibration = get new ground pressure value
|
||||||
int32_t baroPressure = 0;
|
int32_t baroPressure = 0;
|
||||||
int32_t baroTemperature = 0;
|
int32_t baroTemperature = 0;
|
||||||
uint32_t baroPressureSum = 0;
|
uint32_t baroPressureSum = 0;
|
||||||
int32_t BaroAlt = 0;
|
|
||||||
int32_t sonarAlt; // to think about the unit
|
|
||||||
int32_t EstAlt; // in cm
|
|
||||||
int32_t BaroPID = 0;
|
int32_t BaroPID = 0;
|
||||||
int32_t AltHold;
|
int32_t BaroAlt = 0;
|
||||||
int32_t errorAltitudeI = 0;
|
|
||||||
int32_t vario = 0; // variometer in cm/s
|
|
||||||
int16_t throttleAngleCorrection = 0; // correction of throttle in lateral wind,
|
|
||||||
float magneticDeclination = 0.0f; // calculated at startup from config
|
float magneticDeclination = 0.0f; // calculated at startup from config
|
||||||
float accVelScale;
|
|
||||||
float throttleAngleScale;
|
|
||||||
|
|
||||||
// **************
|
// **************
|
||||||
// gyro+acc IMU
|
// gyro+acc IMU
|
||||||
|
@ -350,7 +380,6 @@ int getEstimatedAltitude(void)
|
||||||
int32_t error;
|
int32_t error;
|
||||||
int32_t baroVel;
|
int32_t baroVel;
|
||||||
int32_t vel_tmp;
|
int32_t vel_tmp;
|
||||||
int32_t BaroAlt_tmp;
|
|
||||||
int32_t setVel;
|
int32_t setVel;
|
||||||
float dt;
|
float dt;
|
||||||
float vel_acc;
|
float vel_acc;
|
||||||
|
@ -359,29 +388,18 @@ int getEstimatedAltitude(void)
|
||||||
static float vel = 0.0f;
|
static float vel = 0.0f;
|
||||||
static float accAlt = 0.0f;
|
static float accAlt = 0.0f;
|
||||||
static int32_t lastBaroAlt;
|
static int32_t lastBaroAlt;
|
||||||
static int32_t baroGroundAltitude = 0;
|
|
||||||
static int32_t baroGroundPressure = 0;
|
|
||||||
|
|
||||||
dTime = currentT - previousT;
|
dTime = currentT - previousT;
|
||||||
if (dTime < UPDATE_INTERVAL)
|
if (dTime < UPDATE_INTERVAL)
|
||||||
return 0;
|
return 0;
|
||||||
previousT = currentT;
|
previousT = currentT;
|
||||||
|
|
||||||
if (calibratingB > 0) {
|
if (!isBaroCalibrationComplete()) {
|
||||||
baroGroundPressure -= baroGroundPressure / 8;
|
performBaroCalibrationCycle();
|
||||||
baroGroundPressure += baroPressureSum / (cfg.baro_tab_size - 1);
|
|
||||||
baroGroundAltitude = (1.0f - powf((baroGroundPressure / 8) / 101325.0f, 0.190295f)) * 4433000.0f;
|
|
||||||
|
|
||||||
vel = 0;
|
vel = 0;
|
||||||
accAlt = 0;
|
accAlt = 0;
|
||||||
calibratingB--;
|
|
||||||
}
|
}
|
||||||
|
BaroAlt = Baro_calculateAltitude();
|
||||||
// calculates height from ground via baro readings
|
|
||||||
// see: https://github.com/diydrones/ardupilot/blob/master/libraries/AP_Baro/AP_Baro.cpp#L140
|
|
||||||
BaroAlt_tmp = lrintf((1.0f - powf((float)(baroPressureSum / (cfg.baro_tab_size - 1)) / 101325.0f, 0.190295f)) * 4433000.0f); // in cm
|
|
||||||
BaroAlt_tmp -= baroGroundAltitude;
|
|
||||||
BaroAlt = lrintf((float)BaroAlt * cfg.baro_noise_lpf + (float)BaroAlt_tmp * (1.0f - cfg.baro_noise_lpf)); // additional LPF to reduce baro noise
|
|
||||||
|
|
||||||
dt = accTimeSum * 1e-6f; // delta acc reading time in seconds
|
dt = accTimeSum * 1e-6f; // delta acc reading time in seconds
|
||||||
|
|
||||||
|
|
|
@ -1,9 +1,14 @@
|
||||||
#include "board.h"
|
#include "board.h"
|
||||||
#include "mw.h"
|
#include "mw.h"
|
||||||
|
|
||||||
|
#include "drivers/barometer_common.h"
|
||||||
|
|
||||||
baro_t baro; // barometer access functions
|
baro_t baro; // barometer access functions
|
||||||
|
|
||||||
#ifdef BARO
|
#ifdef BARO
|
||||||
|
static int32_t baroGroundAltitude = 0;
|
||||||
|
static int32_t baroGroundPressure = 0;
|
||||||
|
|
||||||
void Baro_Common(void)
|
void Baro_Common(void)
|
||||||
{
|
{
|
||||||
static int32_t baroHistTab[BARO_TAB_SIZE_MAX];
|
static int32_t baroHistTab[BARO_TAB_SIZE_MAX];
|
||||||
|
@ -46,4 +51,31 @@ int Baro_update(void)
|
||||||
return 1;
|
return 1;
|
||||||
}
|
}
|
||||||
}
|
}
|
||||||
|
|
||||||
|
int32_t Baro_calculateAltitude(void)
|
||||||
|
{
|
||||||
|
int32_t BaroAlt_tmp;
|
||||||
|
|
||||||
|
// calculates height from ground via baro readings
|
||||||
|
// see: https://github.com/diydrones/ardupilot/blob/master/libraries/AP_Baro/AP_Baro.cpp#L140
|
||||||
|
BaroAlt_tmp = lrintf((1.0f - powf((float)(baroPressureSum / (cfg.baro_tab_size - 1)) / 101325.0f, 0.190295f)) * 4433000.0f); // in cm
|
||||||
|
BaroAlt_tmp -= baroGroundAltitude;
|
||||||
|
BaroAlt = lrintf((float)BaroAlt * cfg.baro_noise_lpf + (float)BaroAlt_tmp * (1.0f - cfg.baro_noise_lpf)); // additional LPF to reduce baro noise
|
||||||
|
|
||||||
|
return BaroAlt;
|
||||||
|
}
|
||||||
|
|
||||||
|
void performBaroCalibrationCycle(void)
|
||||||
|
{
|
||||||
|
baroGroundPressure -= baroGroundPressure / 8;
|
||||||
|
baroGroundPressure += baroPressureSum / (cfg.baro_tab_size - 1);
|
||||||
|
baroGroundAltitude = (1.0f - powf((baroGroundPressure / 8) / 101325.0f, 0.190295f)) * 4433000.0f;
|
||||||
|
|
||||||
|
calibratingB--;
|
||||||
|
}
|
||||||
|
|
||||||
|
bool isBaroCalibrationComplete(void)
|
||||||
|
{
|
||||||
|
return calibratingB == 0;
|
||||||
|
}
|
||||||
#endif /* BARO */
|
#endif /* BARO */
|
||||||
|
|
|
@ -1,8 +1,9 @@
|
||||||
#pragma once
|
#pragma once
|
||||||
|
|
||||||
extern baro_t baro;
|
|
||||||
|
|
||||||
#ifdef BARO
|
#ifdef BARO
|
||||||
void Baro_Common(void);
|
void Baro_Common(void);
|
||||||
int Baro_update(void);
|
int Baro_update(void);
|
||||||
|
int32_t Baro_calculateAltitude(void);
|
||||||
|
bool isBaroCalibrationComplete(void);
|
||||||
|
void performBaroCalibrationCycle(void);
|
||||||
#endif
|
#endif
|
||||||
|
|
|
@ -6,6 +6,8 @@
|
||||||
#include "flight_common.h"
|
#include "flight_common.h"
|
||||||
#include "statusindicator.h"
|
#include "statusindicator.h"
|
||||||
|
|
||||||
|
uint16_t calibratingG = 0;
|
||||||
|
uint16_t acc_1G = 256; // this is the 1G measured acceleration.
|
||||||
sensor_t gyro; // gyro access functions
|
sensor_t gyro; // gyro access functions
|
||||||
|
|
||||||
void GYRO_Common(void)
|
void GYRO_Common(void)
|
||||||
|
|
|
@ -1,5 +1,6 @@
|
||||||
#pragma once
|
#pragma once
|
||||||
|
|
||||||
|
extern uint16_t acc_1G;
|
||||||
extern sensor_t gyro;
|
extern sensor_t gyro;
|
||||||
|
|
||||||
void GYRO_Common(void);
|
void GYRO_Common(void);
|
||||||
|
|
|
@ -7,15 +7,16 @@
|
||||||
|
|
||||||
#include "sensors_common.h"
|
#include "sensors_common.h"
|
||||||
|
|
||||||
uint16_t calibratingB = 0; // baro calibration = get new ground pressure value
|
|
||||||
uint16_t calibratingG = 0;
|
|
||||||
uint16_t acc_1G = 256; // this is the 1G measured acceleration.
|
|
||||||
int16_t heading, magHold;
|
int16_t heading, magHold;
|
||||||
|
|
||||||
extern uint16_t batteryWarningVoltage;
|
extern uint16_t batteryWarningVoltage;
|
||||||
extern uint8_t batteryCellCount;
|
extern uint8_t batteryCellCount;
|
||||||
extern float magneticDeclination;
|
extern float magneticDeclination;
|
||||||
|
|
||||||
|
extern sensor_t gyro;
|
||||||
|
extern baro_t baro;
|
||||||
|
extern sensor_t acc;
|
||||||
|
|
||||||
#ifdef FY90Q
|
#ifdef FY90Q
|
||||||
// FY90Q analog gyro/acc
|
// FY90Q analog gyro/acc
|
||||||
void sensorsAutodetect(void)
|
void sensorsAutodetect(void)
|
||||||
|
|
Loading…
Add table
Add a link
Reference in a new issue