mirror of https://github.com/ArduPilot/ardupilot
Working on baromemter altitude
This commit is contained in:
parent
377aea7ef3
commit
0db1a41316
|
@ -34,14 +34,14 @@ static const uint32_t gpsBaud = 38400;
|
|||
static const uint32_t hilBaud = 115200;
|
||||
|
||||
// optional sensors
|
||||
static const bool gpsEnabled = false;
|
||||
static const bool baroEnabled = false;
|
||||
static const bool gpsEnabled = true;
|
||||
static const bool baroEnabled = true;
|
||||
static const bool compassEnabled = true;
|
||||
static const Matrix3f compassOrientation = AP_COMPASS_COMPONENTS_UP_PINS_FORWARD;
|
||||
// compass orientation: See AP_Compass_HMC5843.h for possible values
|
||||
|
||||
// battery monitoring
|
||||
static const bool batteryMonitorEnabled = false;
|
||||
static const bool batteryMonitorEnabled = true;
|
||||
static const uint8_t batteryPin = 0;
|
||||
static const float batteryVoltageDivRatio = 6;
|
||||
static const float batteryMinVolt = 10.0;
|
||||
|
|
|
@ -5,8 +5,9 @@
|
|||
* Author: jgoppert
|
||||
*/
|
||||
|
||||
#include "AP_Navigator.h"
|
||||
#include "../FastSerial/FastSerial.h"
|
||||
#include "AP_Navigator.h"
|
||||
#include "AP_CommLink.h"
|
||||
#include "AP_HardwareAbstractionLayer.h"
|
||||
#include "../AP_DCM/AP_DCM.h"
|
||||
#include "../AP_Math/AP_Math.h"
|
||||
|
@ -98,7 +99,58 @@ void DcmNavigator::calibrate() {
|
|||
if (_hal->imu) {
|
||||
_hal->imu->init(IMU::COLD_START,delay,_hal->scheduler);
|
||||
}
|
||||
|
||||
if (_hal->baro) {
|
||||
// XXX should be moved to hal ctor
|
||||
_hal->baro->Init(1,false);
|
||||
// for apm 2 _hal->baro->Init(1,true);
|
||||
int flashcount = 0;
|
||||
|
||||
while(getGroundPressure() == 0){
|
||||
_hal->baro->Read(); // Get initial data from absolute pressure sensor
|
||||
setGroundPressure(_hal->baro->Press);
|
||||
setGroundTemperature(_hal->baro->Temp);
|
||||
//mavlink_delay(20);
|
||||
delay(20);
|
||||
//Serial.printf("_hal->baro->Press %ld\n", _hal->baro->Press);
|
||||
}
|
||||
|
||||
for(int i = 0; i < 30; i++){ // We take some readings...
|
||||
|
||||
//#if HIL_MODE == HIL_MODE_SENSORS
|
||||
//gcs_update(); // look for inbound hil packets
|
||||
//#endif
|
||||
|
||||
_hal->baro->Read(); // Get initial data from absolute pressure sensor
|
||||
setGroundPressure((getGroundPressure() * 9l + _hal->baro->Press) / 10l);
|
||||
setGroundTemperature((getGroundTemperature() * 9 + _hal->baro->Temp) / 10);
|
||||
|
||||
//mavlink_delay(20);
|
||||
delay(20);
|
||||
if(flashcount == 5) {
|
||||
digitalWrite(_hal->cLedPin, LOW);
|
||||
digitalWrite(_hal->aLedPin, HIGH);
|
||||
digitalWrite(_hal->bLedPin, LOW);
|
||||
}
|
||||
|
||||
if(flashcount >= 10) {
|
||||
flashcount = 0;
|
||||
digitalWrite(_hal->cLedPin, LOW);
|
||||
digitalWrite(_hal->aLedPin, HIGH);
|
||||
digitalWrite(_hal->bLedPin, LOW);
|
||||
}
|
||||
flashcount++;
|
||||
}
|
||||
|
||||
// TODO implement
|
||||
//saveGroundPressure();
|
||||
//saveGroundTemperature();
|
||||
//
|
||||
_hal->debug->printf_P(PSTR("abs_pressure %ld\n"),getGroundPressure());
|
||||
_hal->gcs->sendText(SEVERITY_LOW, PSTR("barometer calibration complete\n"));
|
||||
}
|
||||
}
|
||||
|
||||
void DcmNavigator::updateFast(float dt) {
|
||||
|
||||
if (_hal->getMode() != MODE_LIVE)
|
||||
|
@ -123,10 +175,16 @@ void DcmNavigator::updateFast(float dt) {
|
|||
setAlt(_rangeFinderDown->distance);
|
||||
|
||||
else {
|
||||
float tmp = (_hal->baro->Press / 101325.0);
|
||||
tmp = pow(tmp, 0.190295);
|
||||
//setAlt(44330 * (1.0 - tmp)); //sets the altitude in meters XXX wrong, baro reads 0 press
|
||||
setAlt(0.0);
|
||||
float x, scaling, temp;
|
||||
|
||||
_hal->baro->Read(); // Get new data from absolute pressure sensor
|
||||
|
||||
//abs_pressure = (abs_pressure + barometer.Press) >> 1; // Small filtering
|
||||
float abs_pressure = (getGroundPressure() * .7) + (_hal->baro->Press * .3); // large filtering
|
||||
scaling = getGroundPressure() / (float)abs_pressure;
|
||||
temp = (getGroundTemperature()) + 273.15f;
|
||||
x = log(scaling) * temp * 29271.267f;
|
||||
setAlt(x / 10);
|
||||
}
|
||||
}
|
||||
|
||||
|
|
|
@ -264,6 +264,21 @@ public:
|
|||
_windSpeed = windSpeed;
|
||||
}
|
||||
|
||||
float getGroundPressure() const {
|
||||
return _groundPressure;
|
||||
}
|
||||
|
||||
void setGroundPressure(long groundPressure) {
|
||||
_groundPressure = groundPressure;
|
||||
}
|
||||
|
||||
float getGroundTemperature() const {
|
||||
return _groundTemperature;
|
||||
}
|
||||
|
||||
void setGroundTemperature(long groundTemperature) {
|
||||
_groundTemperature = groundTemperature;
|
||||
}
|
||||
|
||||
protected:
|
||||
AP_HardwareAbstractionLayer * _hal;
|
||||
|
@ -287,6 +302,8 @@ private:
|
|||
int32_t _lat_degInt; // deg / 1e7
|
||||
int32_t _lon_degInt; // deg / 1e7
|
||||
int32_t _alt_intM; // meters / 1e3
|
||||
float _groundTemperature; // XXX units?
|
||||
float _groundPressure; // XXX units?
|
||||
};
|
||||
|
||||
class DcmNavigator: public AP_Navigator {
|
||||
|
|
Loading…
Reference in New Issue