22 #ifndef OV_MSCKF_UPDATER_SLAM_H 23 #define OV_MSCKF_UPDATER_SLAM_H 25 #include <Eigen/Eigen> 34 class FeatureInitializer;
70 void update(std::shared_ptr<State> state, std::vector<std::shared_ptr<ov_core::Feature>> &feature_vec);
77 void delayed_init(std::shared_ptr<State> state, std::vector<std::shared_ptr<ov_core::Feature>> &feature_vec);
87 void change_anchors(std::shared_ptr<State> state);
97 void perform_anchor_change(std::shared_ptr<State> state, std::shared_ptr<ov_type::Landmark> landmark,
double new_anchor_timestamp,
115 #endif // OV_MSCKF_UPDATER_SLAM_H Extended Kalman Filter estimator.
Struct which stores general updater options.
std::shared_ptr< ov_core::FeatureInitializer > initializer_feat
Feature initializer class object.
std::map< int, double > chi_squared_table
Chi squared 95th percentile table (lookup would be size of residual)
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
Will compute the system for our sparse SLAM features and update the filter.
UpdaterOptions _options_aruco
Options used during update for aruco features.
UpdaterOptions _options_slam
Options used during update for slam features.