forked from Archive/PX4-Autopilot
Merge branch 'cmake-2' into cmake-2-pthread
This commit is contained in:
commit
5d9b115fa5
|
@ -33,10 +33,12 @@
|
||||||
|
|
||||||
set(SRCS)
|
set(SRCS)
|
||||||
|
|
||||||
|
list(APPEND SRCS
|
||||||
|
ringbuffer.cpp
|
||||||
|
integrator.cpp
|
||||||
|
)
|
||||||
|
|
||||||
if(${OS} STREQUAL "nuttx")
|
if(${OS} STREQUAL "nuttx")
|
||||||
list(APPEND SRCS
|
|
||||||
ringbuffer.cpp
|
|
||||||
)
|
|
||||||
if (NOT ${BOARD} STREQUAL "sim")
|
if (NOT ${BOARD} STREQUAL "sim")
|
||||||
list(APPEND SRCS
|
list(APPEND SRCS
|
||||||
device_nuttx.cpp
|
device_nuttx.cpp
|
||||||
|
@ -54,7 +56,6 @@ else()
|
||||||
vdev_posix.cpp
|
vdev_posix.cpp
|
||||||
i2c_posix.cpp
|
i2c_posix.cpp
|
||||||
sim.cpp
|
sim.cpp
|
||||||
ringbuffer.cpp
|
|
||||||
)
|
)
|
||||||
endif()
|
endif()
|
||||||
|
|
||||||
|
|
|
@ -0,0 +1,127 @@
|
||||||
|
/****************************************************************************
|
||||||
|
*
|
||||||
|
* Copyright (c) 2015 PX4 Development Team. All rights reserved.
|
||||||
|
*
|
||||||
|
* Redistribution and use in source and binary forms, with or without
|
||||||
|
* modification, are permitted provided that the following conditions
|
||||||
|
* are met:
|
||||||
|
*
|
||||||
|
* 1. Redistributions of source code must retain the above copyright
|
||||||
|
* notice, this list of conditions and the following disclaimer.
|
||||||
|
* 2. Redistributions in binary form must reproduce the above copyright
|
||||||
|
* notice, this list of conditions and the following disclaimer in
|
||||||
|
* the documentation and/or other materials provided with the
|
||||||
|
* distribution.
|
||||||
|
* 3. Neither the name PX4 nor the names of its contributors may be
|
||||||
|
* used to endorse or promote products derived from this software
|
||||||
|
* without specific prior written permission.
|
||||||
|
*
|
||||||
|
* THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
|
||||||
|
* "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
|
||||||
|
* LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
|
||||||
|
* FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
|
||||||
|
* COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
|
||||||
|
* INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
|
||||||
|
* BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS
|
||||||
|
* OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED
|
||||||
|
* AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
|
||||||
|
* LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
|
||||||
|
* ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
|
||||||
|
* POSSIBILITY OF SUCH DAMAGE.
|
||||||
|
*
|
||||||
|
****************************************************************************/
|
||||||
|
|
||||||
|
/**
|
||||||
|
* @file integrator.cpp
|
||||||
|
*
|
||||||
|
* A resettable integrator
|
||||||
|
*
|
||||||
|
* @author Lorenz Meier <lorenz@px4.io>
|
||||||
|
*/
|
||||||
|
|
||||||
|
#include "integrator.h"
|
||||||
|
|
||||||
|
Integrator::Integrator(uint64_t auto_reset_interval, bool coning_compensation) :
|
||||||
|
_auto_reset_interval(auto_reset_interval),
|
||||||
|
_last_integration(0),
|
||||||
|
_last_auto(0),
|
||||||
|
_integral_auto(0.0f, 0.0f, 0.0f),
|
||||||
|
_integral_read(0.0f, 0.0f, 0.0f),
|
||||||
|
_last_val(0.0f, 0.0f, 0.0f),
|
||||||
|
_last_delta(0.0f, 0.0f, 0.0f),
|
||||||
|
_auto_callback(nullptr),
|
||||||
|
_coning_comp_on(coning_compensation)
|
||||||
|
{
|
||||||
|
|
||||||
|
}
|
||||||
|
|
||||||
|
Integrator::~Integrator()
|
||||||
|
{
|
||||||
|
|
||||||
|
}
|
||||||
|
|
||||||
|
bool
|
||||||
|
Integrator::put(uint64_t timestamp, math::Vector<3> &val, math::Vector<3> &integral, uint64_t &integral_dt)
|
||||||
|
{
|
||||||
|
bool auto_reset = false;
|
||||||
|
|
||||||
|
if (_last_integration == 0) {
|
||||||
|
/* this is the first item in the integrator */
|
||||||
|
_last_integration = timestamp;
|
||||||
|
_last_auto = timestamp;
|
||||||
|
_last_val = val;
|
||||||
|
return false;
|
||||||
|
}
|
||||||
|
|
||||||
|
// Integrate
|
||||||
|
double dt = (double)(timestamp - _last_integration) / 1000000.0;
|
||||||
|
math::Vector<3> i = (val + _last_val) * dt * 0.5f;
|
||||||
|
|
||||||
|
// Apply coning compensation if required
|
||||||
|
if (_coning_comp_on) {
|
||||||
|
// Coning compensation derived by Paul Riseborough and Jonathan Challinger,
|
||||||
|
// following:
|
||||||
|
// Tian et al (2010) Three-loop Integration of GPS and Strapdown INS with Coning and Sculling Compensation
|
||||||
|
// Available: http://www.sage.unsw.edu.au/snap/publications/tian_etal2010b.pdf
|
||||||
|
|
||||||
|
i += ((_integral_auto + _last_delta * (1.0f / 6.0f)) % i) * 0.5f;
|
||||||
|
}
|
||||||
|
|
||||||
|
_integral_auto += i;
|
||||||
|
_integral_read += i;
|
||||||
|
|
||||||
|
_last_integration = timestamp;
|
||||||
|
_last_val = val;
|
||||||
|
_last_delta = i;
|
||||||
|
|
||||||
|
if ((timestamp - _last_auto) > _auto_reset_interval) {
|
||||||
|
if (_auto_callback) {
|
||||||
|
/* call the callback */
|
||||||
|
_auto_callback(timestamp, _integral_auto);
|
||||||
|
}
|
||||||
|
|
||||||
|
integral = _integral_auto;
|
||||||
|
integral_dt = (timestamp - _last_auto);
|
||||||
|
|
||||||
|
auto_reset = true;
|
||||||
|
_last_auto = timestamp;
|
||||||
|
_integral_auto(0) = 0.0f;
|
||||||
|
_integral_auto(1) = 0.0f;
|
||||||
|
_integral_auto(2) = 0.0f;
|
||||||
|
}
|
||||||
|
|
||||||
|
return auto_reset;
|
||||||
|
}
|
||||||
|
|
||||||
|
math::Vector<3>
|
||||||
|
Integrator::read(bool auto_reset)
|
||||||
|
{
|
||||||
|
math::Vector<3> val = _integral_read;
|
||||||
|
if (auto_reset) {
|
||||||
|
_integral_read(0) = 0.0f;
|
||||||
|
_integral_read(1) = 0.0f;
|
||||||
|
_integral_read(2) = 0.0f;
|
||||||
|
}
|
||||||
|
|
||||||
|
return val;
|
||||||
|
}
|
|
@ -43,8 +43,6 @@
|
||||||
|
|
||||||
#include <mathlib/mathlib.h>
|
#include <mathlib/mathlib.h>
|
||||||
|
|
||||||
#include <mathlib/mathlib.h>
|
|
||||||
|
|
||||||
class Integrator {
|
class Integrator {
|
||||||
public:
|
public:
|
||||||
Integrator(uint64_t auto_reset_interval = 4000 /* 250 Hz */, bool coning_compensation = false);
|
Integrator(uint64_t auto_reset_interval = 4000 /* 250 Hz */, bool coning_compensation = false);
|
||||||
|
@ -59,7 +57,7 @@ public:
|
||||||
* @return true if putting the item triggered an integral reset
|
* @return true if putting the item triggered an integral reset
|
||||||
* and the integral should be published
|
* and the integral should be published
|
||||||
*/
|
*/
|
||||||
bool put(hrt_abstime timestamp, math::Vector<3> &val, math::Vector<3> &integral, uint64_t &integral_dt);
|
bool put(uint64_t timestamp, math::Vector<3> &val, math::Vector<3> &integral, uint64_t &integral_dt);
|
||||||
|
|
||||||
/**
|
/**
|
||||||
* Get the current integral value
|
* Get the current integral value
|
||||||
|
@ -79,105 +77,20 @@ public:
|
||||||
/**
|
/**
|
||||||
* Get current integral start time
|
* Get current integral start time
|
||||||
*/
|
*/
|
||||||
hrt_abstime current_integral_start() { return _last_auto; }
|
uint64_t current_integral_start() { return _last_auto; }
|
||||||
|
|
||||||
private:
|
private:
|
||||||
hrt_abstime _auto_reset_interval; /**< the interval after which the content will be published and the integrator reset */
|
uint64_t _auto_reset_interval; /**< the interval after which the content will be published and the integrator reset */
|
||||||
hrt_abstime _last_integration; /**< timestamp of the last integration step */
|
uint64_t _last_integration; /**< timestamp of the last integration step */
|
||||||
hrt_abstime _last_auto; /**< last auto-announcement of integral value */
|
uint64_t _last_auto; /**< last auto-announcement of integral value */
|
||||||
math::Vector<3> _integral_auto; /**< the integrated value which auto-resets after _auto_reset_interval */
|
math::Vector<3> _integral_auto; /**< the integrated value which auto-resets after _auto_reset_interval */
|
||||||
math::Vector<3> _integral_read; /**< the integrated value since the last read */
|
math::Vector<3> _integral_read; /**< the integrated value since the last read */
|
||||||
math::Vector<3> _last_val; /**< previously integrated last value */
|
math::Vector<3> _last_val; /**< previously integrated last value */
|
||||||
math::Vector<3> _last_delta; /**< last local delta */
|
math::Vector<3> _last_delta; /**< last local delta */
|
||||||
void (*_auto_callback)(hrt_abstime, math::Vector<3>); /**< the function callback for auto-reset */
|
void (*_auto_callback)(uint64_t, math::Vector<3>); /**< the function callback for auto-reset */
|
||||||
bool _coning_comp_on; /**< coning compensation */
|
bool _coning_comp_on; /**< coning compensation */
|
||||||
|
|
||||||
/* we don't want this class to be copied */
|
/* we don't want this class to be copied */
|
||||||
Integrator(const Integrator&);
|
Integrator(const Integrator&);
|
||||||
Integrator operator=(const Integrator&);
|
Integrator operator=(const Integrator&);
|
||||||
};
|
};
|
||||||
|
|
||||||
Integrator::Integrator(hrt_abstime auto_reset_interval, bool coning_compensation) :
|
|
||||||
_auto_reset_interval(auto_reset_interval),
|
|
||||||
_last_integration(0),
|
|
||||||
_last_auto(0),
|
|
||||||
_integral_auto(0.0f, 0.0f, 0.0f),
|
|
||||||
_integral_read(0.0f, 0.0f, 0.0f),
|
|
||||||
_last_val(0.0f, 0.0f, 0.0f),
|
|
||||||
_last_delta(0.0f, 0.0f, 0.0f),
|
|
||||||
_auto_callback(nullptr),
|
|
||||||
_coning_comp_on(coning_compensation)
|
|
||||||
{
|
|
||||||
|
|
||||||
}
|
|
||||||
|
|
||||||
Integrator::~Integrator()
|
|
||||||
{
|
|
||||||
|
|
||||||
}
|
|
||||||
|
|
||||||
bool
|
|
||||||
Integrator::put(uint64_t timestamp, math::Vector<3> &val, math::Vector<3> &integral, uint64_t &integral_dt)
|
|
||||||
{
|
|
||||||
bool auto_reset = false;
|
|
||||||
|
|
||||||
if (_last_integration == 0) {
|
|
||||||
/* this is the first item in the integrator */
|
|
||||||
_last_integration = timestamp;
|
|
||||||
_last_auto = timestamp;
|
|
||||||
_last_val = val;
|
|
||||||
return false;
|
|
||||||
}
|
|
||||||
|
|
||||||
// Integrate
|
|
||||||
double dt = (double)(timestamp - _last_integration) / 1000000.0;
|
|
||||||
math::Vector<3> i = (val + _last_val) * dt * 0.5f;
|
|
||||||
|
|
||||||
// Apply coning compensation if required
|
|
||||||
if (_coning_comp_on) {
|
|
||||||
// Coning compensation derived by Paul Riseborough and Jonathan Challinger,
|
|
||||||
// following:
|
|
||||||
// Tian et al (2010) Three-loop Integration of GPS and Strapdown INS with Coning and Sculling Compensation
|
|
||||||
// Available: http://www.sage.unsw.edu.au/snap/publications/tian_etal2010b.pdf
|
|
||||||
|
|
||||||
i += ((_integral_auto + _last_delta * (1.0f / 6.0f)) % i) * 0.5f;
|
|
||||||
}
|
|
||||||
|
|
||||||
_integral_auto += i;
|
|
||||||
_integral_read += i;
|
|
||||||
|
|
||||||
_last_integration = timestamp;
|
|
||||||
_last_val = val;
|
|
||||||
_last_delta = i;
|
|
||||||
|
|
||||||
if ((timestamp - _last_auto) > _auto_reset_interval) {
|
|
||||||
if (_auto_callback) {
|
|
||||||
/* call the callback */
|
|
||||||
_auto_callback(timestamp, _integral_auto);
|
|
||||||
}
|
|
||||||
|
|
||||||
integral = _integral_auto;
|
|
||||||
integral_dt = (timestamp - _last_auto);
|
|
||||||
|
|
||||||
auto_reset = true;
|
|
||||||
_last_auto = timestamp;
|
|
||||||
_integral_auto(0) = 0.0f;
|
|
||||||
_integral_auto(1) = 0.0f;
|
|
||||||
_integral_auto(2) = 0.0f;
|
|
||||||
}
|
|
||||||
|
|
||||||
return auto_reset;
|
|
||||||
}
|
|
||||||
|
|
||||||
math::Vector<3>
|
|
||||||
Integrator::read(bool auto_reset)
|
|
||||||
{
|
|
||||||
math::Vector<3> val = _integral_read;
|
|
||||||
if (auto_reset) {
|
|
||||||
_integral_read(0) = 0.0f;
|
|
||||||
_integral_read(1) = 0.0f;
|
|
||||||
_integral_read(2) = 0.0f;
|
|
||||||
}
|
|
||||||
|
|
||||||
return val;
|
|
||||||
}
|
|
||||||
|
|
|
@ -40,6 +40,8 @@ px4_add_module(
|
||||||
attitude_fw/ecl_roll_controller.cpp
|
attitude_fw/ecl_roll_controller.cpp
|
||||||
attitude_fw/ecl_yaw_controller.cpp
|
attitude_fw/ecl_yaw_controller.cpp
|
||||||
l1/ecl_l1_pos_controller.cpp
|
l1/ecl_l1_pos_controller.cpp
|
||||||
|
validation/data_validator.cpp
|
||||||
|
validation/data_validator_group.cpp
|
||||||
DEPENDS
|
DEPENDS
|
||||||
platforms__common
|
platforms__common
|
||||||
)
|
)
|
||||||
|
|
|
@ -113,7 +113,7 @@ AttitudePositionEstimatorEKF *g_estimator = nullptr;
|
||||||
}
|
}
|
||||||
|
|
||||||
AttitudePositionEstimatorEKF::AttitudePositionEstimatorEKF() :
|
AttitudePositionEstimatorEKF::AttitudePositionEstimatorEKF() :
|
||||||
SuperBlock(NULL, "EKF"),
|
SuperBlock(NULL, "PE"),
|
||||||
_task_should_exit(false),
|
_task_should_exit(false),
|
||||||
_task_running(false),
|
_task_running(false),
|
||||||
_estimator_task(-1),
|
_estimator_task(-1),
|
||||||
|
@ -202,9 +202,9 @@ AttitudePositionEstimatorEKF::AttitudePositionEstimatorEKF() :
|
||||||
_newRangeData(false),
|
_newRangeData(false),
|
||||||
|
|
||||||
_mavlink_fd(-1),
|
_mavlink_fd(-1),
|
||||||
_mag_offset_x(this, "PE_MAGB_X"),
|
_mag_offset_x(this, "MAGB_X"),
|
||||||
_mag_offset_y(this, "PE_MAGB_Y"),
|
_mag_offset_y(this, "MAGB_Y"),
|
||||||
_mag_offset_z(this, "PE_MAGB_Z"),
|
_mag_offset_z(this, "MAGB_Z"),
|
||||||
_parameters{},
|
_parameters{},
|
||||||
_parameter_handles{},
|
_parameter_handles{},
|
||||||
_ekf(nullptr),
|
_ekf(nullptr),
|
||||||
|
|
Loading…
Reference in New Issue