22 #ifndef OV_MSCKF_ROS1VISUALIZER_H 23 #define OV_MSCKF_ROS1VISUALIZER_H 25 #include <geometry_msgs/PoseStamped.h> 26 #include <geometry_msgs/PoseWithCovarianceStamped.h> 31 #include <nav_msgs/Odometry.h> 32 #include <nav_msgs/Path.h> 34 #include <sensor_msgs/CameraInfo.h> 35 #include <sensor_msgs/Image.h> 36 #include <sensor_msgs/Imu.h> 37 #include <sensor_msgs/NavSatFix.h> 38 #include <sensor_msgs/PointCloud.h> 39 #include <sensor_msgs/PointCloud2.h> 41 #include <std_msgs/Float64.h> 49 #include <Eigen/Eigen> 50 #include <boost/date_time/posix_time/posix_time.hpp> 51 #include <boost/filesystem.hpp> 83 ROS1Visualizer(std::shared_ptr<ros::NodeHandle> nh, std::shared_ptr<VioManager>
app, std::shared_ptr<Simulator>
sim =
nullptr);
89 void setup_subscribers(std::shared_ptr<ov_core::YamlParser>
parser);
101 void visualize_odometry(
double timestamp);
106 void visualize_final();
109 void callback_inertial(
const sensor_msgs::Imu::ConstPtr &msg);
112 void callback_monocular(
const sensor_msgs::ImageConstPtr &msg0,
int cam_id0);
115 void callback_stereo(
const sensor_msgs::ImageConstPtr &msg0,
const sensor_msgs::ImageConstPtr &msg1,
int cam_id0,
int cam_id1);
119 void publish_state();
122 void publish_images();
125 void publish_features();
128 void publish_groundtruth();
131 void publish_loopclosure_information();
134 std::shared_ptr<ros::NodeHandle>
_nh;
137 std::shared_ptr<VioManager>
_app;
140 std::shared_ptr<Simulator>
_sim;
147 std::shared_ptr<tf::TransformBroadcaster>
mTfBr;
153 std::vector<std::shared_ptr<message_filters::Synchronizer<sync_pol>>>
sync_cam;
154 std::vector<std::shared_ptr<message_filters::Subscriber<sensor_msgs::Image>>>
sync_subs_cam;
157 unsigned int poses_seq_imu = 0;
162 double summed_mse_ori = 0.0;
163 double summed_mse_pos = 0.0;
164 double summed_nees_ori = 0.0;
165 double summed_nees_pos = 0.0;
166 size_t summed_number = 0;
169 bool start_time_set =
false;
170 boost::posix_time::ptime rT1,
rT2;
186 double last_visualization_timestamp = 0;
187 double last_visualization_timestamp_image = 0;
190 std::map<double, Eigen::Matrix<double, 17, 1>>
gt_states;
193 unsigned int poses_seq_gt = 0;
195 bool publish_global2imu_tf =
true;
196 bool publish_calibration_tf =
true;
199 bool save_total_state =
false;
205 #endif // OV_MSCKF_ROS1VISUALIZER_H
image_transport::Publisher it_pub_tracks
std::shared_ptr< Simulator > _sim
Simulator (is nullptr if we are not sim'ing)
std::map< double, Eigen::Matrix< double, 17, 1 > > gt_states
Extended Kalman Filter estimator.
std::deque< ov_core::CameraData > camera_queue
ros::Publisher pub_loop_pose
ros::Publisher pub_poseimu
std::shared_ptr< tf::TransformBroadcaster > mTfBr
ros::Publisher pub_points_slam
std::vector< std::shared_ptr< message_filters::Synchronizer< sync_pol > > > sync_cam
std::vector< geometry_msgs::PoseStamped > poses_imu
ros::Publisher pub_posegt
std::vector< std::shared_ptr< message_filters::Subscriber< sensor_msgs::Image > > > sync_subs_cam
std::shared_ptr< ros::NodeHandle > _nh
Global node handler.
boost::posix_time::ptime rT2
std::shared_ptr< VioManager > _app
Core application of the filter system.
Helper class that will publish results onto the ROS framework.
std::map< int, double > camera_last_timestamp
std::ofstream of_state_std
std::vector< geometry_msgs::PoseStamped > poses_gt
std::shared_ptr< Simulator > sim
std::vector< ros::Subscriber > subs_cam
std::mutex camera_queue_mtx
std::atomic< bool > thread_update_running
message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, sensor_msgs::Image > sync_pol