Robotics StackExchange | Archived questions

Run the /ros_gz_sim_demos. Fail to dispaly TF in RVIZ

I'm running the last demo at https://github.com/gazebosim/ros_gz/tree/ros2/ros_gz_sim_demos

ros2 launch rosgzsimdemos tfbridge.launch.py

Nothing in RViz

This is the command line warnings:

[parameterbridge-2] [INFO] [1678021804.839323157] [rosgzbridge]: Creating GZ->ROS Bridge: /world/default/model/doublependulumwithbase0/jointstate (gz.msgs.Model) -> /world/default/model/doublependulumwithbase0/jointstate (sensor_msgs/msg/JointState) [parameterbridge-2] [WARN] [1678021804.842176839] [rosgz_bridge]: `Failed to create a bridge for topic [/world/default/model/doublependulumwithbase0/jointstate] with ROS2 type [/world/default/model/doublependulumwithbase0/jointstate] to topic [sensormsgs/msg/JointState] with Gazebo Transport type [gz.msgs.Model]` [parameterbridge-2] [INFO] [1678021804.842504803] [rosgzbridge]: Creating GZ->ROS Bridge: /model/doublependulumwithbase0/pose (gz.msgs.PoseV) -> /model/doublependulumwithbase0/pose (tf2msgs/msg/TFMessage) [parameterbridge-2] [WARN] [1678021804.842745776] [rosgz_bridge]: Failed to create a bridge for topic [/model/doublependulumwithbase0/pose] with ROS2 type [/model/doublependulumwithbase0/pose] to topic [tf2msgs/msg/TFMessage] with Gazebo Transport type [gz.msgs.PoseV] [ign-1] Warning: Ignoring XDGSESSIONTYPE=wayland on Gnome. Use QTQPAPLATFORM=wayland to run on Wayland anyway. [rviz2-3] [INFO] [1678021805.414970125] [rviz2]: Stereo is NOT SUPPORTED [rviz2-3] [INFO] [1678021805.415827030] [rviz2]: OpenGl version: 4.5 (GLSL 4.5) [rviz2-3] [INFO] [1678021805.682274408] [rviz2]: Stereo is NOT SUPPORTED [ign-1] libEGL warning: egl: failed to create dri2 screen [ign-1] libEGL warning: NEEDS EXTENSION: falling back to kmsswrast

Thank you in advance~!

Asked by joshbushdash on 2023-03-05 08:34:56 UTC

Comments

What version of Gazebo and ROS are you using?

Asked by azeey on 2023-03-07 11:45:33 UTC

Thank you for your comment. I'm using ROS humble and gazebo-garden on Ubuntu 22.02.

Asked by joshbushdash on 2023-03-07 21:32:18 UTC

Have you built ros_gz from source in order to use ROS Humble with Gazebo Garden?

Asked by azeey on 2023-03-11 00:38:00 UTC

Answers