@@ -12,11 +12,6 @@ DEFINE_double(
1212 map_publish_interval_s, 2.0 ,
1313 " Interval of publishing the visual-inertial map to ROS [seconds]." );
1414
15- DEFINE_bool (
16- publish_only_on_keyframes, false ,
17- " Publish frames only on keyframes instead of the IMU measurements. This "
18- " means a lower frequency." );
19-
2015DEFINE_bool (
2116 publish_debug_markers, true , " Publish debug sphere markers for T_M_B." );
2217
@@ -27,8 +22,7 @@ DEFINE_string(
2722
2823DEFINE_bool (
2924 visualize_map, true ,
30- " Set to false to disable map visualization. Note: map building needs to be "
31- " active for the visualization." );
25+ " Set to false to disable map visualization during building." );
3226
3327#include " maplab-node/vi-map-with-mutex.h"
3428
@@ -62,8 +56,6 @@ void DataPublisherFlow::registerPublishers() {
6256 node_handle_.advertise <geometry_msgs::Vector3Stamped>(kTopicBiasAcc , 1 );
6357 pub_imu_gyro_bias_ =
6458 node_handle_.advertise <geometry_msgs::Vector3Stamped>(kTopicBiasGyro , 1 );
65- pub_extrinsics_T_C_Bs_ = node_handle_.advertise <geometry_msgs::PoseArray>(
66- kCameraExtrinsicTopic , 1 );
6759}
6860
6961void DataPublisherFlow::attachToMessageFlow (message_flow::MessageFlow* flow) {
@@ -95,17 +87,6 @@ void DataPublisherFlow::attachToMessageFlow(message_flow::MessageFlow* flow) {
9587 [this ](const OdometryEstimate::ConstPtr& state) {
9688 CHECK (state != nullptr );
9789 publishOdometryState (state->timestamp_ns , state->vinode );
98-
99- // Publish estimated camera-extrinsics.
100- geometry_msgs::PoseArray T_C_Bs_message;
101- T_C_Bs_message.header .frame_id = FLAGS_tf_imu_frame;
102- T_C_Bs_message.header .stamp = createRosTimestamp (state->timestamp_ns );
103- for (const auto & cam_idx_T_C_B : state->maplab_camera_index_to_T_C_B ) {
104- geometry_msgs::Pose T_C_B_message;
105- tf::poseKindrToMsg (cam_idx_T_C_B.second , &T_C_B_message);
106- T_C_Bs_message.poses .emplace_back (T_C_B_message);
107- }
108- pub_extrinsics_T_C_Bs_.publish (T_C_Bs_message);
10990 });
11091
11192 // CSV export for end-to-end test.
@@ -161,8 +142,11 @@ void DataPublisherFlow::publishOdometryState(
161142 const vi_map::SensorType base_sensor_type =
162143 sensor_manager_.getSensorType (base_sensor_id);
163144 const std::string base_sensor_tf_frame_id =
164- visualization::convertSensorTypeToTfFrameId (base_sensor_type);
145+ visualization::convertSensorTypeToTfFrameId (base_sensor_type) +
146+ " _0_BASE" ;
165147
148+ // TODO(smauq): Clean up TF frame naming on publishing,
149+ // while also not conflicting with rovioli
166150 visualization::publishTF (
167151 T_M_B, FLAGS_tf_mission_frame, base_sensor_tf_frame_id, timestamp_ros);
168152
0 commit comments