MIT-SPARK / Kimera-VIO-ROS

ROS wrapper for Kimera-VIO
BSD 2-Clause "Simplified" License
376 stars 157 forks source link

Zed2 Camera - No mesh being displayed in rviz #153

Open JoKoll opened 3 years ago

JoKoll commented 3 years ago

Description: I'm trying to run a Zed2 camera live with Kimera. I haven't been able to successfully display the mesh or PointCloud Time Horizon in rviz, but the feature tracks does work. I believe that Kimera-VIO-ROS has been installed correctly since I can run the Euroc rosbag example with the mesh and the PointCloud Time Horizon. I've also tried to run Kimera with a rosbag that I created, using the same topics and launch file (with the exception of sim_time = true) and was able to display the PointCloud Time Horizon in rviz, but not the mesh.

I have created custom param yaml files for the Zed2, and calibrated them with Kalibr as per the directions here. I've been using the grayscale imaging, as I couldn't calibrate the color images, and Kimera displays the following error when using the images_rect_color ros topic anyways:

"F0624 18:40:36.960291 27317 RosDataProviderInterface.cpp:71] Check failed: cv_ptr->encoding == sensor_msgs::image_encodings::MONO8 (bgra8 vs. mono8) Expected image with MONO8, BGR8, or RGB8 encoding.Add in here more conversions if you wish."

Command: Each line is in a new terminal:

roscore
roslaunch zed_wrapper zed2.launch
roslaunch kimera_vio_ros kimera_vio_zed2.launch
rviz

For rviz, I've just been manually setting the views when it opens and recently just checking to see if the mesh is being displayed after making a change.

Console output: roscore

... logging to /home/blueksy/.ros/log/1a11799c-d54c-11eb-99b2-d45d64bbac34/roslaunch-BlueSky-26307.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://BlueSky:42307/
ros_comm version 1.14.11

SUMMARY
========

PARAMETERS
 * /rosdistro: melodic
 * /rosversion: 1.14.11

NODES

auto-starting new master
process[master]: started with pid [26344]
ROS_MASTER_URI=http://BlueSky:11311/

setting /run_id to 1a11799c-d54c-11eb-99b2-d45d64bbac34
process[rosout-1]: started with pid [26382]
started core service [/rosout]

Zed2 Launch

... logging to /home/blueksy/.ros/log/9472a604-d54a-11eb-99b2-d45d64bbac34/roslaunch-BlueSky-25813.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://BlueSky:46663/

SUMMARY
========

PARAMETERS
 * /rosdistro: melodic
 * /rosversion: 1.14.11
 * /zed2/zed2_description: <?xml version="1....
 * /zed2/zed_node/auto_exposure_gain: True
 * /zed2/zed_node/auto_whitebalance: True
 * /zed2/zed_node/brightness: 4
 * /zed2/zed_node/contrast: 4
 * /zed2/zed_node/depth/depth_downsample_factor: 1.0
 * /zed2/zed_node/depth/depth_stabilization: 1
 * /zed2/zed_node/depth/max_depth: 20.0
 * /zed2/zed_node/depth/min_depth: 0.3
 * /zed2/zed_node/depth/openni_depth_mode: False
 * /zed2/zed_node/depth/quality: 1
 * /zed2/zed_node/depth/sensing_mode: 0
 * /zed2/zed_node/depth_confidence: 50
 * /zed2/zed_node/depth_texture_conf: 100
 * /zed2/zed_node/exposure: 100
 * /zed2/zed_node/gain: 100
 * /zed2/zed_node/gamma: 8
 * /zed2/zed_node/general/base_frame: base_link
 * /zed2/zed_node/general/camera_flip: False
 * /zed2/zed_node/general/camera_model: zed2
 * /zed2/zed_node/general/camera_name: zed2
 * /zed2/zed_node/general/gpu_id: -1
 * /zed2/zed_node/general/grab_frame_rate: 30
 * /zed2/zed_node/general/resolution: 2
 * /zed2/zed_node/general/self_calib: True
 * /zed2/zed_node/general/serial_number: 0
 * /zed2/zed_node/general/svo_compression: 2
 * /zed2/zed_node/general/verbose: False
 * /zed2/zed_node/general/zed_id: 0
 * /zed2/zed_node/hue: 0
 * /zed2/zed_node/mapping/fused_pointcloud_freq: 1.0
 * /zed2/zed_node/mapping/mapping_enabled: False
 * /zed2/zed_node/mapping/max_mapping_range: -1
 * /zed2/zed_node/mapping/resolution: 0.05
 * /zed2/zed_node/object_detection/body_fitting: False
 * /zed2/zed_node/object_detection/confidence_threshold: 50
 * /zed2/zed_node/object_detection/max_range: 15.0
 * /zed2/zed_node/object_detection/mc_animal: True
 * /zed2/zed_node/object_detection/mc_bag: True
 * /zed2/zed_node/object_detection/mc_electronics: True
 * /zed2/zed_node/object_detection/mc_fruit_vegetable: True
 * /zed2/zed_node/object_detection/mc_people: True
 * /zed2/zed_node/object_detection/mc_vehicle: True
 * /zed2/zed_node/object_detection/model: 3
 * /zed2/zed_node/object_detection/object_tracking_enabled: True
 * /zed2/zed_node/object_detection/od_enabled: False
 * /zed2/zed_node/point_cloud_freq: 15.0
 * /zed2/zed_node/pos_tracking/area_memory: True
 * /zed2/zed_node/pos_tracking/area_memory_db_path: 
 * /zed2/zed_node/pos_tracking/fixed_z_value: 0.0
 * /zed2/zed_node/pos_tracking/floor_alignment: False
 * /zed2/zed_node/pos_tracking/imu_fusion: True
 * /zed2/zed_node/pos_tracking/init_odom_with_first_valid_pose: True
 * /zed2/zed_node/pos_tracking/initial_base_pose: [0.0, 0.0, 0.0, 0...
 * /zed2/zed_node/pos_tracking/map_frame: map
 * /zed2/zed_node/pos_tracking/odometry_frame: odom
 * /zed2/zed_node/pos_tracking/path_max_count: -1
 * /zed2/zed_node/pos_tracking/path_pub_rate: 2.0
 * /zed2/zed_node/pos_tracking/pos_tracking_enabled: True
 * /zed2/zed_node/pos_tracking/publish_map_tf: True
 * /zed2/zed_node/pos_tracking/publish_tf: True
 * /zed2/zed_node/pos_tracking/two_d_mode: False
 * /zed2/zed_node/pub_frame_rate: 15.0
 * /zed2/zed_node/saturation: 4
 * /zed2/zed_node/sensors/publish_imu_tf: True
 * /zed2/zed_node/sensors/sensors_timestamp_sync: False
 * /zed2/zed_node/sharpness: 4
 * /zed2/zed_node/stream: 
 * /zed2/zed_node/svo_file: 
 * /zed2/zed_node/video/extrinsic_in_camera_frame: True
 * /zed2/zed_node/video/img_downsample_factor: 1.0
 * /zed2/zed_node/whitebalance_temperature: 42

NODES
  /zed2/
    zed2_state_publisher (robot_state_publisher/robot_state_publisher)
    zed_node (zed_wrapper/zed_wrapper_node)

ROS_MASTER_URI=http://localhost:11311

process[zed2/zed2_state_publisher-1]: started with pid [25885]
process[zed2/zed_node-2]: started with pid [25886]
[ INFO] [1624580190.053493440]: Initializing nodelet with 28 worker threads.
[ INFO] [1624580190.075127136]: ********** Starting nodelet '/zed2/zed_node' **********
[ INFO] [1624580190.075201029]: SDK version : 3.5.0
[ INFO] [1624580190.075232659]: *** GENERAL PARAMETERS ***
[ INFO] [1624580190.075545143]:  * Camera Name          -> zed2
[ INFO] [1624580190.075856622]:  * Camera Resolution        -> HD720
[ INFO] [1624580190.076156006]:  * Camera Grab Framerate    -> 30
[ INFO] [1624580190.076445157]:  * Gpu ID           -> -1
[ INFO] [1624580190.076732782]:  * Camera ID            -> -1
[ INFO] [1624580190.077020391]:  * Verbose          -> DISABLED
[ INFO] [1624580190.077583132]:  * Camera Flip          -> DISABLED
[ INFO] [1624580190.078119334]:  * Self calibration     -> ENABLED
[ INFO] [1624580190.078655199]:  * Camera Model by param    -> zed2
[ INFO] [1624580190.078678076]: *** VIDEO PARAMETERS ***
[ INFO] [1624580190.078993688]:  * Image resample factor    -> 1
[ INFO] [1624580190.079277601]:  * Extrinsic param. frame   -> X RIGHT - Y DOWN - Z FWD
[ INFO] [1624580190.079300583]: *** DEPTH PARAMETERS ***
[ INFO] [1624580190.079582616]:  * Depth quality        -> PERFORMANCE
[ INFO] [1624580190.079864728]:  * Depth Sensing mode       -> STANDARD
[ INFO] [1624580190.080143436]:  * OpenNI mode          -> DISABLED
[ INFO] [1624580190.080421567]:  * Depth Stabilization      -> ENABLED
[ INFO] [1624580190.080708925]:  * Minimum depth        -> 0.3 m
[ INFO] [1624580190.080993707]:  * Maximum depth        -> 20 m
[ INFO] [1624580190.081631071]:  * Depth resample factor    -> 1
[ INFO] [1624580190.081673505]: *** POSITIONAL TRACKING PARAMETERS ***
[ INFO] [1624580190.083662391]:  * Positional tracking      -> ENABLED
[ INFO] [1624580190.084055856]:  * Path rate            -> 2 Hz
[ INFO] [1624580190.085271243]:  * Path history size        -> 1
[ INFO] [1624580190.086786738]:  * Odometry DB path     -> 
[ INFO] [1624580190.088340423]:  * Spatial Memory       -> ENABLED
[ INFO] [1624580190.089299193]:  * IMU Fusion           -> ENABLED
[ INFO] [1624580190.090565065]:  * Floor alignment      -> DISABLED
[ INFO] [1624580190.091544369]:  * Init Odometry with first valid pose data -> ENABLED
[ INFO] [1624580190.092482417]:  * Two D mode           -> DISABLED
[ INFO] [1624580190.093393658]: *** MAPPING PARAMETERS ***
[ INFO] [1624580190.094318573]:  * Mapping          -> DISABLED
[ INFO] [1624580190.094356437]: *** OBJECT DETECTION PARAMETERS ***
[ INFO] [1624580190.095242045]:  * Object Detection     -> DISABLED
[ INFO] [1624580190.095278114]: *** SENSORS PARAMETERS ***
[ INFO] [1624580190.095740069]:  * Sensors timestamp sync   -> DISABLED
[ INFO] [1624580190.095775043]: *** SVO PARAMETERS ***
[ INFO] [1624580190.096655867]:  * SVO input file:      -> 
[ INFO] [1624580190.097131181]:  * SVO REC compression      -> H265 (HEVC)
[ INFO] [1624580190.098059338]: *** COORDINATE FRAMES ***
[ INFO] [1624580190.100798556]:  * map_frame            -> map
[ INFO] [1624580190.100849573]:  * odometry_frame       -> odom
[ INFO] [1624580190.100879980]:  * base_frame           -> base_link
[ INFO] [1624580190.100909067]:  * camera_frame         -> zed2_camera_center
[ INFO] [1624580190.100935759]:  * imu_link         -> zed2_imu_link
[ INFO] [1624580190.100963392]:  * left_camera_frame        -> zed2_left_camera_frame
[ INFO] [1624580190.100992173]:  * left_camera_optical_frame    -> zed2_left_camera_optical_frame
[ INFO] [1624580190.101018701]:  * right_camera_frame       -> zed2_right_camera_frame
[ INFO] [1624580190.101046280]:  * right_camera_optical_frame   -> zed2_right_camera_optical_frame
[ INFO] [1624580190.101073293]:  * depth_frame          -> zed2_left_camera_frame
[ INFO] [1624580190.101100239]:  * depth_optical_frame      -> zed2_left_camera_optical_frame
[ INFO] [1624580190.101127185]:  * disparity_frame      -> zed2_left_camera_frame
[ INFO] [1624580190.101155427]:  * disparity_optical_frame  -> zed2_left_camera_optical_frame
[ INFO] [1624580190.101181497]:  * confidence_frame     -> zed2_left_camera_frame
[ INFO] [1624580190.101209431]:  * confidence_optical_frame -> zed2_left_camera_optical_frame
[ INFO] [1624580190.102159885]:  * Broadcast odometry TF    -> ENABLED
[ INFO] [1624580190.102976403]:  * Broadcast map pose TF    -> ENABLED
[ INFO] [1624580190.103742680]:  * Broadcast IMU pose TF    -> ENABLED
[ INFO] [1624580190.103772282]: *** DYNAMIC PARAMETERS (Init. values) ***
[ INFO] [1624580190.104169854]:  * [DYN] Depth confidence   -> 50
[ INFO] [1624580190.104572172]:  * [DYN] Depth texture conf.    -> 100
[ INFO] [1624580190.104986851]:  * [DYN] pub_frame_rate     -> 15 Hz
[ INFO] [1624580190.105392037]:  * [DYN] point_cloud_freq   -> 15 Hz
[ INFO] [1624580190.105815105]:  * [DYN] brightness     -> 4
[ INFO] [1624580190.106221077]:  * [DYN] contrast       -> 4
[ INFO] [1624580190.106623291]:  * [DYN] hue            -> 0
[ INFO] [1624580190.107026201]:  * [DYN] saturation     -> 4
[ INFO] [1624580190.107420564]:  * [DYN] sharpness      -> 4
[ INFO] [1624580190.107814090]:  * [DYN] gamma          -> 8
[ INFO] [1624580190.108210127]:  * [DYN] auto_exposure_gain -> ENABLED
[ INFO] [1624580190.109316490]:  * [DYN] auto_whitebalance  -> ENABLED
[ INFO] [1624580190.114943747]:  * Camera coordinate system -> Right HANDED Z UP and X FORWARD
[ INFO] [1624580190.115034098]:  *** Opening ZED 2...
[ INFO] [1624580191.086089941]: ZED connection -> SUCCESS
[ INFO] [1624580193.086428885]:  ...  ZED ready
[ INFO] [1624580193.086504321]: ZED SDK running on GPU #0
[ INFO] [1624580193.094839221]: Camera-IMU Transform: 
 559B300C09E0
0.999984 0.003808 -0.004283 -0.002000
-0.003809 0.999993 -0.000170 -0.023000
0.004283 0.000187 0.999991 -0.002000
0.000000 0.000000 0.000000 1.000000

[ INFO] [1624580193.094917695]:  * CAMERA MODEL  -> ZED 2
[ INFO] [1624580193.094981208]:  * Serial Number -> 28779637
[ INFO] [1624580193.095028101]:  * Camera FW Version -> 1523
[ INFO] [1624580193.095072406]:  * Sensors FW Version -> 776
[ INFO] [1624580193.225959341]: Advertised on topic /zed2/zed_node/rgb/image_rect_color
[ INFO] [1624580193.226002725]: Advertised on topic /zed2/zed_node/rgb/camera_info
[ INFO] [1624580193.237116374]: Advertised on topic /zed2/zed_node/rgb_raw/image_raw_color
[ INFO] [1624580193.237140879]: Advertised on topic /zed2/zed_node/rgb_raw/camera_info
[ INFO] [1624580193.249004134]: Advertised on topic /zed2/zed_node/left/image_rect_color
[ INFO] [1624580193.249028778]: Advertised on topic /zed2/zed_node/left/camera_info
[ INFO] [1624580193.260973451]: Advertised on topic /zed2/zed_node/left_raw/image_raw_color
[ INFO] [1624580193.260998151]: Advertised on topic /zed2/zed_node/left_raw/camera_info
[ INFO] [1624580193.269375446]: Advertised on topic /zed2/zed_node/right/image_rect_color
[ INFO] [1624580193.269400736]: Advertised on topic /zed2/zed_node/right/camera_info
[ INFO] [1624580193.278033417]: Advertised on topic /zed2/zed_node/right_raw/image_raw_color
[ INFO] [1624580193.278058323]: Advertised on topic /zed2/zed_node/right_raw/camera_info
[ INFO] [1624580193.286832311]: Advertised on topic /zed2/zed_node/rgb/image_rect_gray
[ INFO] [1624580193.286865218]: Advertised on topic /zed2/zed_node/rgb/camera_info
[ INFO] [1624580193.303686780]: Advertised on topic /zed2/zed_node/rgb_raw/image_raw_gray
[ INFO] [1624580193.303712901]: Advertised on topic /zed2/zed_node/rgb_raw/camera_info
[ INFO] [1624580193.323772050]: Advertised on topic /zed2/zed_node/left/image_rect_gray
[ INFO] [1624580193.323824314]: Advertised on topic /zed2/zed_node/left/camera_info
[ INFO] [1624580193.356295877]: Advertised on topic /zed2/zed_node/left_raw/image_raw_gray
[ INFO] [1624580193.356377225]: Advertised on topic /zed2/zed_node/left_raw/camera_info
[ INFO] [1624580193.384056822]: Advertised on topic /zed2/zed_node/right/image_rect_gray
[ INFO] [1624580193.384143649]: Advertised on topic /zed2/zed_node/right/camera_info
[ INFO] [1624580193.408771205]: Advertised on topic /zed2/zed_node/right_raw/image_raw_gray
[ INFO] [1624580193.408859613]: Advertised on topic /zed2/zed_node/right_raw/camera_info
[ INFO] [1624580193.425995179]: Advertised on topic /zed2/zed_node/depth/depth_registered
[ INFO] [1624580193.426073008]: Advertised on topic /zed2/zed_node/depth/camera_info
[ INFO] [1624580193.439893381]: Advertised on topic /zed2/zed_node/stereo/image_rect_color
[ INFO] [1624580193.456095067]: Advertised on topic /zed2/zed_node/stereo_raw/image_raw_color
[ INFO] [1624580193.456865780]: Advertised on topic /zed2/zed_node/confidence/confidence_map
[ INFO] [1624580193.457598097]: Advertised on topic /zed2/zed_node/disparity/disparity_image
[ INFO] [1624580193.458277292]: Advertised on topic /zed2/zed_node/point_cloud/cloud_registered
[ INFO] [1624580193.458983644]: Advertised on topic /zed2/zed_node/pose
[ INFO] [1624580193.459737325]: Advertised on topic /zed2/zed_node/pose_with_covariance
[ INFO] [1624580193.460445271]: Advertised on topic /zed2/zed_node/odom
[ INFO] [1624580193.461103464]: Advertised on topic /zed2/zed_node/path_odom
[ INFO] [1624580193.461942442]: Advertised on topic /zed2/zed_node/path_map
[ INFO] [1624580193.462919945]: Advertised on topic /zed2/zed_node/imu/data
[ INFO] [1624580193.463832456]: Advertised on topic /zed2/zed_node/imu/data_raw
[ INFO] [1624580193.464713195]: Advertised on topic /zed2/zed_node/imu/mag
[ INFO] [1624580193.465498342]: Advertised on topic /zed2/zed_node/temperature/imu
[ INFO] [1624580193.466369680]: Advertised on topic /zed2/zed_node/atm_press
[ INFO] [1624580193.467217720]: Advertised on topic /zed2/zed_node/temperature/left
[ INFO] [1624580193.468031768]: Advertised on topic /zed2/zed_node/temperature/right
[ INFO] [1624580193.468916173]: Advertised on topic /zed2/zed_node/left_cam_imu_transform [LATCHED]
[ INFO] [1624580193.478282740]: *** Starting Positional Tracking ***
[ INFO] [1624580193.478372305]:  * Waiting for valid static transformations...
[ INFO] [1624580193.478537953]: Static transform Sensor to Base [zed2_left_camera_frame -> base_link]
[ INFO] [1624580193.478615014]:  * Translation: {0.000,-0.060,0.000}
[ INFO] [1624580193.478696074]:  * Rotation: {0.000,-0.000,0.000}
[ INFO] [1624580193.478794383]: Static transform Sensor to Camera Center [zed2_left_camera_frame -> zed2_camera_center]
[ INFO] [1624580193.478861136]:  * Translation: {0.000,-0.060,0.000}
[ INFO] [1624580193.478959097]:  * Rotation: {0.000,-0.000,0.000}
[ INFO] [1624580193.479057913]: Static transform Camera Center to Base [zed2_camera_center -> base_link]
[ INFO] [1624580193.479120790]:  * Translation: {0.000,0.000,0.000}
[ INFO] [1624580193.479208348]:  * Rotation: {0.000,-0.000,0.000}
[ INFO] [1624580193.579518314]: Initial ZED left camera pose (ZED pos. tracking): 
[ INFO] [1624580193.579705970]:  * T: [0,0.06,0]
[ INFO] [1624580193.579821067]:  * Q: [0,0,0,1]
[ INFO] [1624580193.827672080]: Odometry aligned to last tracking pose
[ INFO] [1624580193.829472203]: Published static transform 'zed2_imu_link' -> 'zed2_left_camera_frame'

Kimera Launch

... logging to /home/blueksy/.ros/log/9472a604-d54a-11eb-99b2-d45d64bbac34/roslaunch-BlueSky-26049.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://BlueSky:43853/

SUMMARY
========

PARAMETERS
 * /kimera_vio_ros/kimera_vio_ros_node/base_link_frame_id: base_link
 * /kimera_vio_ros/kimera_vio_ros_node/left_cam_frame_id: left_cam
 * /kimera_vio_ros/kimera_vio_ros_node/map_frame_id: map
 * /kimera_vio_ros/kimera_vio_ros_node/mono_ransac_threshold: 30
 * /kimera_vio_ros/kimera_vio_ros_node/online_run: True
 * /kimera_vio_ros/kimera_vio_ros_node/params_folder_path: /home/blueksy/cat...
 * /kimera_vio_ros/kimera_vio_ros_node/position_det_threshold: 0.3
 * /kimera_vio_ros/kimera_vio_ros_node/right_cam_frame_id: right_cam
 * /kimera_vio_ros/kimera_vio_ros_node/stereo_ransac_threshold: 20
 * /kimera_vio_ros/kimera_vio_ros_node/use_lcd: False
 * /kimera_vio_ros/kimera_vio_ros_node/use_online_cam_params: False
 * /kimera_vio_ros/kimera_vio_ros_node/velocity_det_threshold: 0.1
 * /kimera_vio_ros/kimera_vio_ros_node/world_frame_id: map
 * /kimera_vio_ros/posegraph_viewer/frame_id: map
 * /rosdistro: melodic
 * /rosversion: 1.14.11
 * /use_sim_time: False

NODES
  /kimera_vio_ros/
    kimera_vio_ros_node (kimera_vio_ros/kimera_vio_ros_node)
    posegraph_viewer (pose_graph_tools/visualizer_node)

ROS_MASTER_URI=http://localhost:11311

process[kimera_vio_ros/kimera_vio_ros_node-1]: started with pid [26094]
process[kimera_vio_ros/posegraph_viewer-2]: started with pid [26095]
[ INFO] [1624580201.410558167]: Initializing pose graph visualizer
I0624 18:16:41.627053 26094 RegularVioBackend.cpp:114] Using Regular VIO Backend.
I0624 18:16:41.627184 26094 PipelineModule.h:449] MISO Pipeline Module: Display has no output queue registered.
I0624 18:16:41.627322 26094 Pipeline.cpp:296] Pipeline Modules launched (parallel_run set to 1).
I0624 18:16:41.627516 26140 Pipeline.cpp:89] Spinning Kimera-VIO.
I0624 18:16:41.627454 26094 KimeraVioRos.cpp:137] Statistics
-----------                                  #  Log Hz  {avg     +- std    }    [min,max]
VioBackend [ms]                                 0   
VioFrontend [ms]                                0   
Visualizer [ms]                                 0   
backend_input_queue Size [#]                    0   
data_provider_left_frame_queue Size [#]         0   
data_provider_right_frame_queue Size [#]        0   
display_input_queue Size [#]                    0   
frontend_input_queue Size [#]                   0   
mesher_backend Size [#]                         0   
mesher_frontend Size [#]                        0   
visualizer_backend_queue Size [#]               0   
visualizer_frontend_queue Size [#]              0   
visualizer_mesher_queue Size [#]                0   
I0624 18:16:41.905267 26135 VioBackend.h:167] ------------------- Initialize Pipeline: timestamp = 1624580201783312186--------------------
W0624 18:16:41.905323 26135 InitializationFromImu.cpp:25] InitializationFromImu: assumes that the vehicle is stationary and upright along some axis,and gravity vector is along a single axis!
W0624 18:16:41.907094 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
E0624 18:16:41.907801 26136 Mesher.cpp:1729] Delaunay Triangle out of image (size: x: 0, y: 0, height: 720, width 1280
 Triangle: x, y: 
3840, 0
0, 3840
1159.96, 182.25
W0624 18:16:42.006880 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.006916 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.020380 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.021183 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:42.138396 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.138433 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.151633 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.155292 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:42.275810 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.275844 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.290532 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.291553 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:42.405148 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.405186 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.417901 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.418890 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:42.534597 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.534629 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.548816 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.549815 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
I0624 18:16:42.627533 26094 KimeraVioRos.cpp:137] Statistics
-----------                                  #  Log Hz  {avg     +- std    }    [min,max]
Display [ms]                                   11   11.8472 {4.36364 +- 14.4725}    [0,48]
Mesher [ms]                                     6   6.48259 {3.83333 +- 0.983192}   [3,5]
Stereo Data Provider [ms]                       0   
VioBackend [ms]                                 6   6.50526 {1.00000 +- 0.00000}    [1,1]
VioFrontend Frame Rate [ms]                     6   9.16140 {6.00000 +- 2.28035}    [4,10]
VioFrontend Keyframe Rate [ms]                  5   7.77183 {64.4000 +- 2.96648}    [61,69]
VioFrontend [ms]                               12   12.8658 {36.6667 +- 32.4803}    [4,82]
Visualizer [ms]                                 6   6.46208 {0.500000 +- 0.836660}  [0,2]
backend_input_queue Size [#]                    6   5.93282 {1.00000 +- 0.00000}    [1,1]
data_provider_left_frame_queue Size [#]        14   14.1041 {1.00000 +- 0.00000}    [1,1]
data_provider_right_frame_queue Size [#]       14   14.1009 {1.00000 +- 0.00000}    [1,1]
display_input_queue Size [#]                   11   10.7986 {1.00000 +- 0.00000}    [1,1]
frontend_input_queue Size [#]                  13   12.0096 {1.00000 +- 0.00000}    [1,1]
mesher_backend Size [#]                         6   6.50376 {1.00000 +- 0.00000}    [1,1]
mesher_frontend Size [#]                       12   12.8620 {1.41667 +- 0.514929}   [1,2]
visualizer_backend_queue Size [#]               6   6.50381 {1.00000 +- 0.00000}    [1,1]
visualizer_frontend_queue Size [#]             12   12.8622 {1.41667 +- 0.514929}   [1,2]
visualizer_mesher_queue Size [#]                6   6.48026 {1.00000 +- 0.00000}    [1,1]
W0624 18:16:42.669189 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.669219 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.682289 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.682886 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
E0624 18:16:42.683401 26136 Mesher.cpp:1729] Delaunay Triangle out of image (size: x: 0, y: 0, height: 720, width 1280
 Triangle: x, y: 
-3840, -3840
425.669, 10.3721
373.987, 76.9869
W0624 18:16:42.801026 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.801060 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.814270 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.815290 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:42.939544 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:42.939574 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:42.952946 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:42.954002 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.068902 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.068948 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.082612 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.083664 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.203289 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.203320 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.215590 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.216591 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.336061 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.336097 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.349085 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.350324 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.469583 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.469616 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.484233 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.485510 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.602394 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.602427 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.617496 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.618664 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
E0624 18:16:43.619163 26136 Mesher.cpp:1729] Delaunay Triangle out of image (size: x: 0, y: 0, height: 720, width 1280
 Triangle: x, y: 
1135.37, 130.683
3840, 0
1160.25, 182.302
I0624 18:16:43.627529 26094 KimeraVioRos.cpp:137] Statistics
-----------                                  #  Log Hz  {avg     +- std    }    [min,max]
Display [ms]                                   27   13.5291 {1.77778 +- 9.23760}    [0,48]
Mesher [ms]                                    14   7.01551 {3.21429 +- 0.974961}   [2,5]
Stereo Data Provider [ms]                       0   
VioBackend [ms]                                14   7.03093 {0.928571 +- 0.267261}  [0,1]
VioFrontend Frame Rate [ms]                    14   8.13528 {5.14286 +- 1.91581}    [3,10]
VioFrontend Keyframe Rate [ms]                 13   7.59338 {63.4615 +- 2.25889}    [61,69]
VioFrontend [ms]                               28   14.0093 {34.9643 +- 30.6286}    [3,82]
Visualizer [ms]                                14   7.01460 {0.357143 +- 0.744946}  [0,2]
backend_input_queue Size [#]                   14   6.73079 {1.00000 +- 0.00000}    [1,1]
data_provider_left_frame_queue Size [#]        29   14.5575 {1.00000 +- 0.00000}    [1,1]
data_provider_right_frame_queue Size [#]       29   14.5561 {1.00000 +- 0.00000}    [1,1]
display_input_queue Size [#]                   27   12.9435 {1.00000 +- 0.00000}    [1,1]
frontend_input_queue Size [#]                  28   13.4492 {1.00000 +- 0.00000}    [1,1]
mesher_backend Size [#]                        14   7.03019 {1.00000 +- 0.00000}    [1,1]
mesher_frontend Size [#]                       28   14.0073 {1.46429 +- 0.507875}   [1,2]
visualizer_backend_queue Size [#]              14   7.03021 {1.00000 +- 0.00000}    [1,1]
visualizer_frontend_queue Size [#]             28   14.0074 {1.46429 +- 0.507875}   [1,2]
visualizer_mesher_queue Size [#]               14   7.01434 {1.00000 +- 0.00000}    [1,1]
W0624 18:16:43.735371 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.735401 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.747750 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.748931 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.866901 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.866964 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:43.879156 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:43.880383 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:43.997473 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:43.997506 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.010987 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.012148 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:44.139531 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.139569 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.153012 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.154247 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:44.262971 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.263007 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.275091 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.276414 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:44.399817 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.399850 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.411876 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.413158 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
W0624 18:16:44.529263 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.529297 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.541319 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.542671 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
I0624 18:16:44.627533 26094 KimeraVioRos.cpp:137] Statistics
-----------                                  #  Log Hz  {avg     +- std    }    [min,max]
Display [ms]                                   41   14.0598 {1.17073 +- 7.49634}    [0,48]
Mesher [ms]                                    21   7.20155 {2.57143 +- 1.39898}    [0,5]
Stereo Data Provider [ms]                       0   
VioBackend [ms]                                21   7.20353 {0.952381 +- 0.218218}  [0,1]
VioFrontend Frame Rate [ms]                    21   7.92011 {4.71429 +- 1.73617}    [3,10]
VioFrontend Keyframe Rate [ms]                 20   7.58764 {61.7000 +- 3.77108}    [54,69]
VioFrontend [ms]                               42   14.3381 {33.7143 +- 29.6486}    [3,82]
Visualizer [ms]                                21   7.20102 {0.333333 +- 0.730297}  [0,2]
backend_input_queue Size [#]                   21   6.99106 {1.00000 +- 0.00000}    [1,1]
data_provider_left_frame_queue Size [#]        44   14.7035 {1.00000 +- 0.00000}    [1,1]
data_provider_right_frame_queue Size [#]       44   14.7025 {1.00000 +- 0.00000}    [1,1]
display_input_queue Size [#]                   41   13.6375 {1.00000 +- 0.00000}    [1,1]
frontend_input_queue Size [#]                  43   13.9505 {1.00000 +- 0.00000}    [1,1]
mesher_backend Size [#]                        21   7.20300 {1.00000 +- 0.00000}    [1,1]
mesher_frontend Size [#]                       42   14.3368 {1.47619 +- 0.505487}   [1,2]
visualizer_backend_queue Size [#]              21   7.20302 {1.00000 +- 0.00000}    [1,1]
visualizer_frontend_queue Size [#]             42   14.3368 {1.47619 +- 0.505487}   [1,2]
visualizer_mesher_queue Size [#]               21   7.20072 {1.00000 +- 0.00000}    [1,1]
W0624 18:16:44.664160 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.664193 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.677554 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.678860 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
E0624 18:16:44.679008 26136 Mesher.cpp:1729] Delaunay Triangle out of image (size: x: 0, y: 0, height: 720, width 1280
 Triangle: x, y: 
0, 3840
3840, 0
-3840, -3840
W0624 18:16:44.804805 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.804839 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.818614 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.820097 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.
^CW0624 18:16:44.930557 26134 StereoMatcher.cpp:130] sparseStereoMatching: StereoFrame is already rectified!
W0624 18:16:44.930594 26134 StereoCamera.cpp:263] Rectifying already rectified stereo frame ...
I0624 18:16:44.942965 26135 RegularVioBackend.cpp:212] Tracker has a LOW_DISPARITY status.
W0624 18:16:44.947074 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh.

rviz

[ INFO] [1624578531.059344124]: rviz version 1.13.17
[ INFO] [1624578531.059449928]: compiled against Qt version 5.9.5
[ INFO] [1624578531.059480258]: compiled against OGRE version 1.9.0 (Ghadamon)
[ INFO] [1624578531.067894314]: Forcing OpenGl version 0.
[ INFO] [1624578531.741891984]: Stereo is NOT SUPPORTED
[ INFO] [1624578531.741951263]: OpenGL device: NVIDIA GeForce RTX 3090/PCIe/SSE2
[ INFO] [1624578531.741969533]: OpenGl version: 4.6 (GLSL 4.6).

Additional files: My kimera launch file is as follows:

<launch>
  <!-- General Kimera-VIO-ROS launch file. Change arguments in your own launch
  file and include this one to launch KimeraVIO on the dataset of your choice -->
  <arg name="dataset_name" default="Zed2"/>
  <!-- If False, parses the given rosbag, otw it plays the rosbage -->
  <arg name="online" default="true" />
  <!-- !!!! VIT !!!! This should be true when running online with a rosbag publishing clock,
  but false when parsing rosbag? Needs rosbag to be publishing clock -->
  <arg name="should_use_sim_time" default="false"/>
  <param name="use_sim_time" value="$(arg should_use_sim_time)"/>
  <arg name="rosbag_path" unless="$(arg online)"/>

  <!-- Use CameraInfo topics to get parameters, instead of yaml files -->
  <arg name="use_online_cam_params" default="false"/>

  <!-- If true, KimeraVIO will log output of all modules to the
       'log_output_path' location. -->
  <arg name="log_output" default="false"/>
  <arg name="log_output_path"
       default="$(find kimera_vio_ros)/output_logs/"/>
  <!-- If true, log ground-truth poses to a csv file using the
       gt_logger_node (if online is true) or rosbag (if online is false),
       and processing data from the gt_topic rostopic -->
  <arg name="log_gt_data" default="false"/>
  <arg name="gt_topic"    default="ground_truth_odometry_topic"/>

  <!-- If true, KimeraVIO will enable the LoopClosureDetector module. -->
  <arg name="use_lcd" default="false"/>

  <!-- Parameters -->
  <!-- each dataset has its own set of parameter files -->
  <!-- the parameters are set in param folder, ordered by the dataset's name -->
  <arg name="params_folder" default="$(find kimera_vio)/params/$(arg dataset_name)"/>

  <!-- Specify the absolute path to the vocabulary file. -->
  <!-- This is usually in the VIO directory (VIO/vocabulary/ORBvoc.yml). -->
  <arg name="path_to_vocab" default="$(find kimera_vio)/vocabulary/ORBvoc.yml"/>

  <!-- Subscribed Topics -->
  <arg name="left_cam_topic"                    default="/zed2/zed_node/left/image_rect_gray"/>
  <arg name="left_cam_info_topic"               default="/zed2/zed_node/left/camera_info"/>
  <arg name="right_cam_topic"                   default="/zed2/zed_node/right/image_rect_gray"/>
  <arg name="right_cam_info_topic"              default="/zed2/zed_node/right/camera_info"/>
  <arg name="imu_topic"                         default="/zed2/zed_node/imu/data_raw"/>
  <!-- Empty string ("") means no ground-truth available. Used for init if
   requested to do ground-truth initialization. -->
  <arg name="odometry_ground_truth_topic"       default="/zed2/zed_node/odom"/>

  <!-- Frame IDs -->
  <arg name="world_frame_id"     default="map"/>
  <arg name="base_link_frame_id" default="base_link"/>
  <arg name="map_frame_id"       default="map"/>
  <arg name="left_cam_frame_id"  default="left_cam"/>
  <arg name="right_cam_frame_id" default="right_cam"/>

  <!-- General parameters -->
  <arg name="verbosity"    default="0" />
  <!-- Publish pipeline output to ROS. -->
  <!-- Note that this is duplicated from the flags file -->
  <arg name="visualize"    default="true" />
  <!-- Type of visualization: 0: 2d3d_mesh, 1: pointcloud, 2: none -->
  <arg name="viz_type"     default="0" />

  <!-- Only here for convenience -->
  <arg name="run_stereo_dense"     default="false"/>

  <!-- Launch main node  -->
  <node name="kimera_vio_ros_node" pkg="kimera_vio_ros" type="kimera_vio_ros_node"
        output="screen" ns="kimera_vio_ros"
        args="--use_lcd=$(arg use_lcd)
              --vocabulary_path=$(arg path_to_vocab)
              --flagfile=$(arg params_folder)/flags/Mesher.flags
              --flagfile=$(arg params_folder)/flags/VioBackend.flags
              --flagfile=$(arg params_folder)/flags/RegularVioBackend.flags
              --flagfile=$(arg params_folder)/flags/Visualizer3D.flags
              --logtostderr=1
              --colorlogtostderr=1
              --log_prefix=1
              --v=$(arg verbosity)
              --log_output=$(arg log_output)
              --log_euroc_gt_data=$(arg log_output)
              --output_path=$(arg log_output_path)
              --viz_type=$(arg viz_type)
              --visualize=$(arg visualize)">
    <param name="params_folder_path"    value="$(arg params_folder)"/>

    <param name="online_run"            value="$(arg online)"/>
    <param name="use_lcd"               value="$(arg use_lcd)"/>
    <param name="use_online_cam_params" value="$(arg use_online_cam_params)"/>

    <!-- Frame IDs for Odometry -->
    <param name="world_frame_id"     value="$(arg world_frame_id)"/>
    <param name="base_link_frame_id" value="$(arg base_link_frame_id)"/>
    <param name="map_frame_id"       value="$(arg map_frame_id)"/>
    <param name="left_cam_frame_id"  value="$(arg left_cam_frame_id)"/>
    <param name="right_cam_frame_id" value="$(arg right_cam_frame_id)"/>

    <!-- Subscriber topics -->
    <!-- if we run online, use remap -->
    <remap from="left_cam/image_raw"  to="$(arg left_cam_topic)"    if="$(arg online)"/>
    <remap from="right_cam/image_raw" to="$(arg right_cam_topic)"   if="$(arg online)"/>
    <remap from="imu"       to="$(arg imu_topic)"                   if="$(arg online)"/>
    <remap from="gt_odom"   to="$(arg odometry_ground_truth_topic)"
           if="$(eval arg('online') and arg('odometry_ground_truth_topic') != '')"/>

    <remap from="left_cam/camera_info"  to="$(arg left_cam_info_topic)"  if="$(arg online)"/>
    <remap from="right_cam/camera_info" to="$(arg right_cam_info_topic)" if="$(arg online)"/>

    <!-- if we run offline, use params -->
    <param name="rosbag_path"            value="$(arg rosbag_path)"     unless="$(arg online)"/>
    <param name="left_cam_rosbag_topic"  value="$(arg left_cam_topic)"  unless="$(arg online)"/>
    <param name="right_cam_rosbag_topic" value="$(arg right_cam_topic)" unless="$(arg online)"/>
    <param name="imu_rosbag_topic"       value="$(arg imu_topic)"       unless="$(arg online)"/>
    <param name="ground_truth_odometry_rosbag_topic"
           value="$(arg odometry_ground_truth_topic)"                   unless="$(arg online)"/>
    <param name="log_gt_data"            value="$(arg log_gt_data)"     unless="$(arg online)"/>

    <!-- Other subscription topics -->
    <remap from="reinit_flag" to="reinit_flag"/>
    <remap from="reinit_pose" to="reinit_pose"/>

    <!-- Remap publisher topics -->
    <remap from="odometry"                       to="odometry"/>
    <remap from="resiliency"                     to="resiliency"/>
    <remap from="imu_bias"                       to="imu_bias"/>
    <remap from="optimized_trajectory"           to="optimized_trajectory"/>
    <remap from="pose_graph"                     to="pose_graph"/>
    <remap from="mesh"                           to="mesh"/>
    <remap from="frontend_stats"                 to="frontend_stats"/>
    <remap from="debug_mesh_img/image_raw"       to="debug_mesh_img/image_raw"/>
    <remap from="feature_tracks/image_raw"       to="feature_tracks/image_raw"/>
    <remap from="time_horizon_pointcloud"        to="time_horizon_pointcloud"/>

    <!-- Resiliency Thresholds: TODO(Sandro) document -->
    <param name="velocity_det_threshold"  value="0.1"/>
    <param name="position_det_threshold"  value="0.3"/>
    <param name="stereo_ransac_threshold" value="20"/>
    <param name="mono_ransac_threshold"   value="30"/>

    <!-- Load calibration -->
    <!-- <rosparam command="load" file="$(arg params_folder)/calibration.yaml"/> -->
  </node>

  <!-- Launch visualizer -->
  <include file="$(find pose_graph_tools)/launch/posegraph_view.launch" >
    <arg name="frame_id"      value="$(arg world_frame_id)" />
    <arg name="graph_topic"   value="pose_graph" />
    <arg name="ns"            value="kimera_vio_ros"/>
  </include>

  <!-- Log ground-truth data only if requested and if not running in offline mode-->
  <node if="$(eval log_gt_data and online)" name="gt_logger_node" pkg="kimera_vio_ros"
        type="gt_logger_node.py" output="screen">
    <param name="gt_topic"   value="$(arg gt_topic)"/>
    <param name="output_dir" value="$(arg log_output_path)"/>
  </node>

</launch>

I've identified two potential issues, but I'm not sure how to solve them and I'm not sure if they're related:

  1. Both the "map_frame_id" and "world_frame_id" are set to "map" in the launch file. The Zed2 doesn't publish a "world" frame_id and when the "world_frame_id" is set to "world", there is warning in the TF of rviz since there is no transformation between the "world" frame and the "map" frame. I'm unsure how to rectify this or if it's even a problem.

I know that the PointCloud Time Horizon is reliant on the "world" frame ID after I compared the Euroc rosbag to my Zed2 rosbag, where in the Zed2 rosbag, the frame_id in rostopic echo was listed as "map" as per the Kimera launch file. However, in both the live and rosbag scenarios, the mesh topic is not publishing. When being run live, running rostopic echo /kimera_vio_ros/mesh returns nothing, not even the message that nothing is being published. With the Zed2 rosbag, running rostopic echo /kimera_vio/ros/mesh returns that nothing is being published, despite the fact that /clock/ is running, similar to Issue#78. I tried the suggested remedies in the comments, except changing the commits since I got the meshes to work with the Euroc rosbag, but still could not get the mesh to appear.

  1. I repeatedly get the warning "W0624 18:16:44.947074 26136 Mesher.cpp:1377] Missing landmark information to build 3D Mesh." but I'm not sure how to fix it. It was mentioned in Issue#126 as well, but there is no resolution to this issue. This error seems to disappear if Kimera/Zed2 live has been running for a bit. This warning does not appear when playing the Zed2 rosbag.

I've also looked through Issue#105, but nothing I changed showed the mesh in either the live Zed2 or the Zed2 rosbag.

This issue could also be completely unrelated to the above and I've just missed it. Any help to resolve this issue would be much appreciated.

Here is a screenshot of rviz when running kimera with the Zed2 livea and the rqt_graph:

Kimera_Zed2_rviz_live

Zed2_Kimera_dots

Please give also the following information:

JoKoll commented 3 years ago

Following up on this, I think the problem may be related to the frame_ids, but not how I initially thought. I was doing some tests with a D435i and the major difference between them is that Kimera is publishing Frame IDs with the D435i but not with the Zed2. I even just copied the D435i launch file in the repository, and only changing the dataset value and the subscribed topics, but it made no difference. I was wondering what the purpose of this is:

<!-- Launch static TF node from base_link to velo_link -->
 <node pkg="tf" type="static_transform_publisher" name="velo_link_broadcaster"
   args="0 0 0 0 0 0 1 base_link velo_link 100"/>

When viewing the TFs in RVIZ with the D435i, it gives me complete transformations from the "world" frame id and "base_link", "map", "left_cam", and "right_cam" frame IDs. However, using a similar launch file with the Zed2, there are no transformations from the "world" frame id. Here's an image of the TFs in rviz of the Zed2:

No World Transformations

With the D435i, even though the transformations from the "world" frame id to the id frames of the camera (as expected based on the text in the launch file stating that Kimera and Realsense publish conflicting Tfs), there are still the correct transformations to the "base_link", "left_cam" and "right_cam" frame ids. The frames in the visualization area also move when I move the camera, unlike with the Zed2 where nothing other than the "world" frame id shows up in the visualization area.

D435i with World Transformations

Since the _Launch static TF node from base_link to velolink doesn't seem to work with the Zed2 as written, what's the background behind that code? I'm expecting that I'll have to make a custom transform in order to correctly associate Kimera with the Zed2 camera, but I don't know where "velo_link" is coming from. The ros tutorials have some information on the static transform publisher, but not enough to know what I need to put there.

I think this missing transform is also why rostopic list can see the kimera_vio_ros topics (such as mesh, time_horizon_pointcloud, and odometry), but when I echo them, nothing is displayed (not even the message that they aren't publishing).

Thanks again for any help on this topic.

MikeDmytrenko commented 2 years ago

Any success with this issue? I`m having the same with ZED2i

vardhandongre commented 2 years ago

Hi, I am having a similar issue with a zed2i camera, not sure what the cause of this is... some possible reasons I can think of are incorrect calibration or incorrect sensor frequency or the tfs, I might be wrong about this but in case someone resolved it please share how. Thanks!