1 #include "../BlockLocalPositionEstimator.hpp" 34 "%5.2f %5.2f %5.2f m std %5.2f %5.2f %5.2f m",
152 if (vision_delay < 0.0
f) { vision_delay = 0.0f; }
155 if (
getDelayPeriods(_param_lpe_vis_delay.get() > 0.0f ? _param_lpe_vis_delay.get() : vision_delay, &i_hist) < 0) {
return; }
165 for (
size_t i = 0; i < 3; i++) {
170 for (
size_t i = 3; i < 6; i++) {
179 float beta = (r.
transpose() * (S_I * r))(0, 0);
uint64_t _global_ref_timestamp
#define mavlink_log_critical(_pub, _text,...)
Send a mavlink critical message and print to console.
static const float BETA_TABLE[7]
void visionCheckTimeout()
matrix::Vector< Type, M > getMean()
int getDelayPeriods(float delay, uint8_t *periods)
int globallocalconverter_getref(double *lat_0, double *lon_0, float *alt_0)
Get reference position of the global to local converter.
Matrix< Type, N, M > transpose() const
#define mavlink_and_console_log_info(_pub, _text,...)
Send a mavlink emergency message and print to console.
struct map_projection_reference_s _map_ref
static constexpr float EP_MAX_STD_DEV
orb_advert_t mavlink_log_pub
static const uint32_t REQ_VISION_INIT_COUNT
float vel_pos_innov_var[6]
Vector< float, 6 > f(float t, const Matrix< float, 6, 1 > &, const Matrix< float, 3, 1 > &)
__BEGIN_DECLS typedef void * orb_advert_t
ORB topic advertiser handle.
int visionMeasure(Vector< float, n_y_vision > &y)
Matrix< float, n_x, n_x > m_P
matrix::Vector< Type, M > getStdDev()
uORB::SubscriptionData< vehicle_odometry_s > _sub_visual_odom
uint64_t _time_last_vision_p
float pose_covariance[21]
matrix::Matrix< Type, M, N > get(size_t delay)
bool globallocalconverter_initialized()
Checks if globallocalconverter was initialized.
static const uint32_t VISION_TIMEOUT
BlockStats< float, n_y_vision > _visionStats
BlockDelay< float, n_x, 1, HIST_LEN > _xDelay
bool _altOriginInitialized
int map_projection_init(struct map_projection_reference_s *ref, double lat_0, double lon_0)
Initializes the map transformation given by the argument and sets the timestamp to now...
uORB::PublicationData< ekf2_innovations_s > _pub_innov
void update(const matrix::Vector< Type, M > &u)