ANYbotics / elevation_mapping

Robot-centric elevation mapping for rough terrain navigation
BSD 3-Clause "New" or "Revised" License
1.25k stars 436 forks source link

Elevation Map not Displaying in RViz (elevation_mapping/elevation_map_raw topic not being published) #205

Open nbertschmann opened 2 years ago

nbertschmann commented 2 years ago

I have been attempting to use ZED point cloud data to test out the elevation_mapping package.

First, here is the output I get using rqt_graph. The elevation_mapping node is subscribed to the down-sampled point cloud (type sensor_msgs/PointCloud2), the pose of the ZED camera (type geometry_msgs/PoseWithCovariance), and tf.

bug_image2

In RViz, the pointcloud from the ZED camera displays properly, but the elevation mapping data from elevation_mapping_raw is not displaying. Below is a screenshot of my RViz window:

elevation_mapping_issue

My bagfile info is below. As you can see, the elevation mapping node published 31 /elevation_mapping/elevation_map topic messages. However, it does not seem that any /elevation_mapping/elevation_map_raw topic messages were published.

path:        2022-03-28-01-47-54.bag
version:     2.0
duration:    23.0s
start:       Mar 28 2022 01:48:04.00 (1648446484.00)
end:         Mar 28 2022 01:48:26.97 (1648446506.97)
size:        483.1 MB
messages:    1274
compression: none [70/70 chunks]
types:       bond/Status                             [eacc84bf5d65b6777d4c50f463dfb9c8]
             diagnostic_msgs/DiagnosticArray         [60810da900de1dd6ddd437c3503511da]
             dynamic_reconfigure/Config              [958f16a05573709014982821e6822580]
             dynamic_reconfigure/ConfigDescription   [757ce9d44ba8ddd801bb30bc456f946f]
             geometry_msgs/PoseStamped               [d3812c3cbc69362b77dc0b19b345f8f5]
             geometry_msgs/PoseWithCovarianceStamped [953b798c0f514ff060a53a3498ce6246]
             grid_map_msgs/GridMap                   [95681e052b1f73bf87b7eb984382b401]
             nav_msgs/Odometry                       [cd5e73d190d741a2f92e81eda573aca7]
             nav_msgs/Path                           [6227e2b7e9cce15051f669a5e197bbf7]
             rosgraph_msgs/Log                       [acffd30cd6b6de30f120938c17c593fb]
             sensor_msgs/CameraInfo                  [c9a58c1b0b154e0e6da7578cb991d214]
             sensor_msgs/CompressedImage             [8f7a12909da2c9d3332d540a0977563f]
             sensor_msgs/Image                       [060021388200f6f0f447d0fcd9c64743]
             sensor_msgs/PointCloud2                 [1158d486dd51d683ce2f1be655c3c181]
             stereo_msgs/DisparityImage              [04a177815f75271039fa21f16acad8c9]
             tf2_msgs/TFMessage                      [94810edda583a504dfda3829e70d7eec]
             theora_image_transport/Packet           [33ac4e14a7cff32e7e0d65f18bb410f3]
             visualization_msgs/Marker               [4048c9de2a16f4ae8e0538085ebf1b97]
topics:      /camera/depth/points_downsampled                                                   29 msgs    : sensor_msgs/PointCloud2                
             /diagnostics                                                                       19 msgs    : diagnostic_msgs/DiagnosticArray        
             /elevation_map_fused_visualization/elevation_cloud                                 26 msgs    : sensor_msgs/PointCloud2                
             /elevation_map_fused_visualization/lower_bound_cloud                               28 msgs    : sensor_msgs/PointCloud2                
             /elevation_map_fused_visualization/map_region                                      28 msgs    : visualization_msgs/Marker              
             /elevation_map_fused_visualization/upper_bound_cloud                               29 msgs    : sensor_msgs/PointCloud2                
             /elevation_mapping/elevation_map                                                   31 msgs    : grid_map_msgs/GridMap                  
             /elevation_mapping/visibility_cleanup_map                                          31 msgs    : grid_map_msgs/GridMap                  
             /pcl_manager/bond
...

To add to this - on RViz, I can see that the elevation_mapping/elevation_map topic messages are being published successfully:

elevation_map_msg

However, it appears that the elevation_mapping/elevation_map_raw messages are not being published:

elevation_mapping_raw_msg

Not sure if this helps, but here is the output from roslaunch elevation_mapping_demos zed_test2.launch (modified version of simple_demo to test elevation mapping with ZED input):

nbertsch@nbertsch-desktop:~/catkin_ws3$ roslaunch elevation_mapping_demos zed_test2.launch
... logging to /home/nbertsch/.ros/log/48b65074-ae59-11ec-a3cb-1c1bb5e39bda/roslaunch-nbertsch-desktop-26528.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://nbertsch-desktop:34905/

SUMMARY
========

PARAMETERS
 * /elevation_map_fused_visualization/grid_map_topic: /elevation_mappin...
 * /elevation_map_fused_visualization/grid_map_visualizations: [{'type': 'point_...
 * /elevation_map_raw_visualization/grid_map_topic: /elevation_mappin...
 * /elevation_map_raw_visualization/grid_map_visualizations: [{'type': 'point_...
 * /elevation_mapping/input_sources/zed/publish_on_update: True
 * /elevation_mapping/input_sources/zed/queue_size: 1
 * /elevation_mapping/input_sources/zed/sensor_processor/apply_voxelgrid_filter: True
 * /elevation_mapping/input_sources/zed/sensor_processor/cutoff_max_depth: 20
 * /elevation_mapping/input_sources/zed/sensor_processor/cutoff_min_depth: 0.3
 * /elevation_mapping/input_sources/zed/sensor_processor/depth_to_disparity_factor: 47.3
 * /elevation_mapping/input_sources/zed/sensor_processor/ignore_points_above: 1.4
 * /elevation_mapping/input_sources/zed/sensor_processor/lateral_factor: 0.001376915
 * /elevation_mapping/input_sources/zed/sensor_processor/p_1: 0.03287
 * /elevation_mapping/input_sources/zed/sensor_processor/p_2: -0.0001276
 * /elevation_mapping/input_sources/zed/sensor_processor/p_3: 0.485
 * /elevation_mapping/input_sources/zed/sensor_processor/p_4: 399.1046
 * /elevation_mapping/input_sources/zed/sensor_processor/p_5: 6.735e-06
 * /elevation_mapping/input_sources/zed/sensor_processor/type: stereo
 * /elevation_mapping/input_sources/zed/sensor_processor/voxelgrid_filter_size: 0.1
 * /elevation_mapping/input_sources/zed/topic: /camera/depth/poi...
 * /elevation_mapping/input_sources/zed/type: pointcloud
 * /elevation_mapping/length_in_x: 2.5
 * /elevation_mapping/length_in_y: 2.5
 * /elevation_mapping/mahalanobis_distance_threshold: 2.5
 * /elevation_mapping/max_variance: 0.01
 * /elevation_mapping/min_variance: 9e-06
 * /elevation_mapping/multi_height_noise: 9e-07
 * /elevation_mapping/position_x: 0.0
 * /elevation_mapping/position_y: 0.0
 * /elevation_mapping/postprocessor_pipeline: [{'type': 'gridMa...
 * /elevation_mapping/resolution: 0.05
 * /elevation_mapping/robot_pose_with_covariance_topic: /zed/zed_node/pos...
 * /rosdistro: melodic
 * /rosversion: 1.14.13
 * /voxel_grid/filter_field_name: z
 * /voxel_grid/filter_limit_max: 6.0
 * /voxel_grid/filter_limit_min: 0.01
 * /voxel_grid/filter_limit_negative: False
 * /voxel_grid/input_frame: base_link
 * /voxel_grid/leaf_size: 0.05
 * /voxel_grid/output_frame: base_link

NODES
  /
    elevation_map_fused_visualization (grid_map_visualization/grid_map_visualization)
    elevation_map_raw_visualization (grid_map_visualization/grid_map_visualization)
    elevation_mapping (elevation_mapping/elevation_mapping)
    pcl_manager (nodelet/nodelet)
    rviz (rviz/rviz)
    voxel_grid (nodelet/nodelet)
    world_to_robot (tf/static_transform_publisher)

ROS_MASTER_URI=http://localhost:11311

process[elevation_mapping-1]: started with pid [26548]
process[world_to_robot-2]: started with pid [26549]
process[elevation_map_fused_visualization-3]: started with pid [26560]
process[elevation_map_raw_visualization-4]: started with pid [26561]
process[rviz-5]: started with pid [26562]
process[pcl_manager-6]: started with pid [26563]
process[voxel_grid-7]: started with pid [26564]
[ INFO] [1648445953.681570594]: Loading nodelet /voxel_grid of type pcl/VoxelGrid to manager pcl_manager with the following remappings:
[ INFO] [1648445953.726820131]: /voxel_grid/input -> /zed/zed_node/point_cloud/cloud_registered
[ INFO] [1648445953.727232746]: /voxel_grid/output -> /camera/depth/points_downsampled
[ INFO] [1648445953.769681688]: waitForService: Service [/pcl_manager/load_nodelet] has not been advertised, waiting...
[ INFO] [1648445953.941581886]: Initializing nodelet with 4 worker threads.
[ INFO] [1648445954.024428518]: Grid map visualization node started.
[ INFO] [1648445954.102999515]: waitForService: Service [/pcl_manager/load_nodelet] is now available.
[ INFO] [1648445954.138126491]: grid_map_visualizations: Configured visualization of type 'point_cloud' with name 'elevation_cloud'.
[ INFO] [1648445954.138236858]: grid_map_visualizations: Configured visualization of type 'point_cloud' with name 'upper_bound_cloud'.
[ INFO] [1648445954.138289881]: grid_map_visualizations: Configured visualization of type 'point_cloud' with name 'lower_bound_cloud'.
[ INFO] [1648445954.138384102]: grid_map_visualizations: Configured visualization of type 'map_region' with name 'map_region'.
[ INFO] [1648445954.182202299]: Grid map visualization node started.
[ INFO] [1648445954.187747603]: Grid map visualization initialized.
[ INFO] [1648445954.264175262]: grid_map_visualizations: Configured visualization of type 'point_cloud' with name 'elevation_cloud'.
[ INFO] [1648445954.264672827]: grid_map_visualizations: Configured visualization of type 'point_cloud' with name 'sigma_cloud'.
[ INFO] [1648445954.265062212]: grid_map_visualizations: Configured visualization of type 'map_region' with name 'map_region'.
[ INFO] [1648445954.292971288]: Grid map visualization initialized.
[ WARN] [1648445954.946278984]: Could not find the parameter: `algorithm`. Setting to default value: 'area'.
[ WARN] [1648445954.954347793]: Could not find the parameter: `parallelization_enabled`. Setting to default value: 'false'.
[ WARN] [1648445954.954449202]: Could not find the parameter: `thread_number`. Setting to default value: 'automatic'.
[ INFO] [1648445954.975643047]: Elevation mapping node started.
[ INFO] [1648445955.134808741]: Elevation map grid resized to 50 rows and 50 columns.
[ INFO] [1648445955.780383004]: Subscribing to pointcloud: /camera/depth/points_downsampled, queue_size: 1.
[ INFO] [1648445955.856842122]: Elevation mapping node initializing ... 
[ INFO] [1648445956.857429116]: Successfully launched node.
[ INFO] [1648445958.061376163]: First corresponding point cloud and pose found, elevation mapping started. 
[ERROR] [1648445958.063837999]: Could not get pose information from robot for time 1648445956.360284. Buffer empty?
[ INFO] [1648445958.736752215]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648445969.326827181]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648445980.025774772]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
QObject::connect: Cannot queue arguments of type 'QVector<int>'
(Make sure 'QVector<int>' is registered using qRegisterMetaType().)
QObject::connect: Cannot queue arguments of type 'QVector<int>'
(Make sure 'QVector<int>' is registered using qRegisterMetaType().)
[ INFO] [1648445990.075174573]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446000.767268060]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446011.369331966]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446022.212904541]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446032.716968642]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446043.413005024]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446054.343865369]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446065.242892720]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446076.209670638]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446087.149059940]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446098.100398033]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446109.049564584]: Waiting for tf transformation to be available. (Momeone help me get theessage is throttled, 10s.)
[ INFO] [1648446120.023578234]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446130.995318400]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446141.142775713]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446151.238169288]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446161.239057705]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648446172.153405421]: Waiting for tf transformation to be available. (Message is throttled, 10s.)

I would be greatly appreciated if you can provide some insight as to why the elevation_mapping/elevation_map_raw is not being published.

maximilianwulf commented 2 years ago

Hey, setup should look okay,

I guess there might be problem with the tf/pose information, i.e. the following part from the console:

[ERROR] [1648445958.063837999]: Could not get pose information from robot for time 1648445956.360284. Buffer empty?
[ INFO] [1648445958.736752215]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
nbertschmann commented 2 years ago

@maximilianwulf Is there any way to subscribe to a "fake pose" to see if my pose input is the issue?

maximilianwulf commented 2 years ago

Hm, yes, but you have to create the fake pose.

I would actually try the waffle demo first and then just rewire the point clouds, and see if it reacts.

nbertschmann commented 2 years ago

@maximilianwulf Thank you for the advice - I just tried this out.

I'm still getting the same issue where the elevation_mapping/elevation_map topic is being published, but elevation_mapping/elevation_map_raw is not.

Here is what I modified in the turtlesim3_wafffle_demo.launch file. The input to the down-sample filter is now /zed/zed_node/point_cloud/cloud_registered

  <!-- Run a passthrough filter to down-sample the sensor point cloud.-->
  <node pkg="nodelet" type="nodelet" name="pcl_manager" args="manager" output="screen"/>
  <node pkg="nodelet" type="nodelet" name="voxel_grid" args="load pcl/VoxelGrid pcl_manager" output="screen">
    <remap from="~input" to="/zed/zed_node/point_cloud/cloud_registered"/> 
    <remap from="~output" to="/camera/depth/points_downsampled"/>
    <rosparam>
      filter_field_name: z
      filter_limit_min: 0.01
      filter_limit_max: 6.0  <!-- Limit the range of points to forward to 6 meters in viewing direction-->
      filter_limit_negative: False
      leaf_size: 0.05  <!-- Limit the density to 5 cm-->
    </rosparam>
  </node>

rqt_graph:

turtlebot_bug_rqt

RViz Window:

turtlebot_test

Terminal Output:

nbertsch@nbertsch-desktop:~/catkin_ws$ roslaunch elevation_mapping_demos turtlesim3_waffle_demo2.launch
... logging to /home/nbertsch/.ros/log/0ea855d8-b054-11ec-a556-1c1bb5e39bda/roslaunch-nbertsch-desktop-10065.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.

xacro: in-order processing became default in ROS Melodic. You can drop the option.
started roslaunch server http://nbertsch-desktop:46879/

SUMMARY
========

PARAMETERS
 * /elevation_mapping/enable_visibility_cleanup: False
 * /elevation_mapping/fused_map_publishing_rate: 0.5
 * /elevation_mapping/init_submap_height_offset: 0.01
 * /elevation_mapping/initialization_method: 0
 * /elevation_mapping/initialize_elevation_map: False
 * /elevation_mapping/input_sources/zed/publish_on_update: True
 * /elevation_mapping/input_sources/zed/queue_size: 1
 * /elevation_mapping/input_sources/zed/sensor_processor/apply_voxelgrid_filter: True
 * /elevation_mapping/input_sources/zed/sensor_processor/cutoff_max_depth: 20
 * /elevation_mapping/input_sources/zed/sensor_processor/cutoff_min_depth: 0.3
 * /elevation_mapping/input_sources/zed/sensor_processor/depth_to_disparity_factor: 47.3
 * /elevation_mapping/input_sources/zed/sensor_processor/ignore_points_above: 1.4
 * /elevation_mapping/input_sources/zed/sensor_processor/lateral_factor: 0.001376915
 * /elevation_mapping/input_sources/zed/sensor_processor/p_1: 0.03287
 * /elevation_mapping/input_sources/zed/sensor_processor/p_2: -0.0001276
 * /elevation_mapping/input_sources/zed/sensor_processor/p_3: 0.485
 * /elevation_mapping/input_sources/zed/sensor_processor/p_4: 399.1046
 * /elevation_mapping/input_sources/zed/sensor_processor/p_5: 6.735e-06
 * /elevation_mapping/input_sources/zed/sensor_processor/type: stereo
 * /elevation_mapping/input_sources/zed/sensor_processor/voxelgrid_filter_size: 0.1
 * /elevation_mapping/input_sources/zed/topic: /camera/depth/poi...
 * /elevation_mapping/input_sources/zed/type: pointcloud
 * /elevation_mapping/length_in_x: 6.0
 * /elevation_mapping/length_in_x_init_submap: 1.0
 * /elevation_mapping/length_in_y: 6.0
 * /elevation_mapping/length_in_y_init_submap: 1.0
 * /elevation_mapping/mahalanobis_distance_threshold: 2.5
 * /elevation_mapping/map_frame_id: odom
 * /elevation_mapping/margin_init_submap: 0.3
 * /elevation_mapping/max_variance: 0.05
 * /elevation_mapping/min_update_rate: 2.0
 * /elevation_mapping/min_variance: 0.0001
 * /elevation_mapping/multi_height_noise: 0.001
 * /elevation_mapping/position_x: 0.0
 * /elevation_mapping/position_y: 0.0
 * /elevation_mapping/postprocessor_pipeline: [{'type': 'gridMa...
 * /elevation_mapping/resolution: 0.1
 * /elevation_mapping/robot_base_frame_id: base_footprint
 * /elevation_mapping/robot_motion_map_update/covariance_scale: 0.01
 * /elevation_mapping/robot_pose_cache_size: 200
 * /elevation_mapping/robot_pose_with_covariance_topic: /base_footprint_pose
 * /elevation_mapping/scanning_duration: 1.0
 * /elevation_mapping/sensor_processor/ignore_points_above: 0.4
 * /elevation_mapping/surface_normal_positive_axis: z
 * /elevation_mapping/target_frame_init_submap: base_footprint
 * /elevation_mapping/time_offset_for_point_cloud: 0.0
 * /elevation_mapping/time_tolerance: 1.0
 * /elevation_mapping/track_point_frame_id: base_footprint
 * /elevation_mapping/track_point_x: 0.0
 * /elevation_mapping/track_point_y: 0.0
 * /elevation_mapping/track_point_z: 0.0
 * /elevation_mapping/visibility_cleanup_rate: 1.0
 * /gazebo/enable_ros_network: True
 * /robot_description: <?xml version="1....
 * /rosdistro: melodic
 * /rosversion: 1.14.13
 * /use_sim_time: True
 * /voxel_grid/filter_field_name: z
 * /voxel_grid/filter_limit_max: 6.0
 * /voxel_grid/filter_limit_min: 0.01
 * /voxel_grid/filter_limit_negative: False
 * /voxel_grid/leaf_size: 0.05
 * /waffle_pose_publisher/from_frame: odom
 * /waffle_pose_publisher/to_frame: base_footprint

NODES
  /
    elevation_mapping (elevation_mapping/elevation_mapping)
    gazebo (gazebo_ros/gzserver)
    pcl_manager (nodelet/nodelet)
    rviz (rviz/rviz)
    spawn_urdf (gazebo_ros/spawn_model)
    voxel_grid (nodelet/nodelet)
    waffle_pose_publisher (elevation_mapping_demos/tf_to_pose_publisher.py)
    waffle_state_publisher (robot_state_publisher/robot_state_publisher)

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

setting /run_id to 0ea855d8-b054-11ec-a556-1c1bb5e39bda
process[rosout-1]: started with pid [10103]
started core service [/rosout]
process[gazebo-2]: started with pid [10112]
process[spawn_urdf-3]: started with pid [10128]
process[waffle_state_publisher-4]: started with pid [10133]
process[waffle_pose_publisher-5]: started with pid [10134]
process[pcl_manager-6]: started with pid [10136]
process[voxel_grid-7]: started with pid [10148]
process[elevation_mapping-8]: started with pid [10158]
process[rviz-9]: started with pid [10177]
[ INFO] [1648663566.765015416]: Loading nodelet /voxel_grid of type pcl/VoxelGrid to manager pcl_manager with the following remappings:
[ INFO] [1648663566.797206592]: /voxel_grid/input -> /zed/zed_node/point_cloud/cloud_registered
[ INFO] [1648663566.797273989]: /voxel_grid/output -> /camera/depth/points_downsampled
[ INFO] [1648663566.866433546]: waitForService: Service [/pcl_manager/load_nodelet] has not been advertised, waiting...
[ INFO] [1648663566.880825940]: Initializing nodelet with 4 worker threads.
[ INFO] [1648663566.946185713]: waitForService: Service [/pcl_manager/load_nodelet] is now available.
[ WARN] [1648663567.827211072]: Could not find the parameter: `algorithm`. Setting to default value: 'area'.
[ WARN] [1648663567.838409218]: Could not find the parameter: `parallelization_enabled`. Setting to default value: 'false'.
[ WARN] [1648663567.838569483]: Could not find the parameter: `thread_number`. Setting to default value: 'automatic'.
[ INFO] [1648663567.851380742]: Elevation mapping node started.
[ INFO] [1648663568.006554899]: Elevation map grid resized to 60 rows and 60 columns.
[ INFO] [1648663568.838019761]: Subscribing to pointcloud: /camera/depth/points_downsampled, queue_size: 1.
[ INFO] [1648663568.983613143]: Elevation mapping node initializing ... 
[ INFO] [1648663569.936265999]: Finished loading Gazebo ROS API Plugin.
[ INFO] [1648663569.950289682]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting...
[ INFO] [1648663573.107441974]: waitForService: Service [/gazebo/set_physics_properties] is now available.
[ INFO] [1648663574.735791469, 0.001000000]: Camera Plugin: Using the 'robotNamespace' param: '/'
[ INFO] [1648663574.747741709, 0.001000000]: Camera Plugin (ns = /)  <tf_prefix_>, set to ""
[ INFO] [1648663575.251642035, 0.001000000]: Laser Plugin: Using the 'robotNamespace' param: '/'
[ INFO] [1648663575.279057755, 0.001000000]: Starting Laser Plugin (ns = /)
[ INFO] [1648663575.299410022, 0.001000000]: Laser Plugin (ns = /)  <tf_prefix_>, set to ""
[ INFO] [1648663575.337552671, 0.001000000]: Physics dynamic reconfigure ready.
[ INFO] [1648663575.378494502, 0.001000000]: Starting plugin DiffDrive(ns = //)
[ INFO] [1648663575.379390461, 0.001000000]: DiffDrive(ns = //): <rosDebugLevel> = na
[ INFO] [1648663575.382296886, 0.001000000]: DiffDrive(ns = //): <tf_prefix> = 
[ INFO] [1648663575.386357558, 0.001000000]: DiffDrive(ns = //): Advertise joint_states
[ INFO] [1648663575.390057284, 0.001000000]: DiffDrive(ns = //): Try to subscribe to cmd_vel
[ INFO] [1648663575.451213670, 0.001000000]: DiffDrive(ns = //): Subscribe to cmd_vel
[ INFO] [1648663575.466507272, 0.001000000]: DiffDrive(ns = //): Advertise odom on odom 
[spawn_urdf-3] process has finished cleanly
log file: /home/nbertsch/.ros/log/0ea855d8-b054-11ec-a556-1c1bb5e39bda/spawn_urdf-3*.log
[ INFO] [1648663581.451937249, 1.001000000]: Successfully launched node.
[ INFO] [1648663666.591700287, 22.692000000]: First corresponding point cloud and pose found, elevation mapping started. 
[ INFO] [1648663666.920748203, 22.777000000]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648663712.469113885, 32.801000000]: Waiting for tf transformation to be available. (Message is throttled, 10s.)
[ INFO] [1648663761.629760742, 42.864000000]: Waiting for tf transformation to be available. (Message is throttled, 10s.)

Looks like it may be a TF issue from the ZED camera? Any idea how this could be fixed?

maximilianwulf commented 2 years ago

Waiting for tf transformation to be available. (Message is throttled, 10s.)

My best guess would be that the ZED driver does not properly publish the static tf tree. Sorry I have no experience with that driver.

Musab-Imadeldin commented 1 year ago

Hi, I'm facing the same issue @nbertschmann. What were the steps you took to resolve this?

I'm modifying the simple demo launch and I'm trying to set the d435i camera I have. A comment would be appreciated.

hsurya08 commented 1 year ago

Hi, I am facing the same issue @nbertschmann. Are you able to find the solution?