Closed c-rizz closed 1 year ago
Hi i am also new to ros2 + gazebo, so i am aswell maximum confused on how to get things started.
bash ros2 launch ros_gz_sim_demos camera.launch.py
returns
[INFO] [launch]: All log files can be found below /home/asfoe/.ros/log/2022-12-21-23-32-32-116961-asfoe-t14-946394
[INFO] [launch]: Default logging verbosity is set to INFO
[INFO] [ruby $(which gz) sim-1]: process started with pid [946395]
[INFO] [parameter_bridge-2]: process started with pid [946397]
[INFO] [rviz2-3]: process started with pid [946401]
[rviz2-3] QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-asfoe'
[parameter_bridge-2] [INFO] [1671665552.321776905] [ros_gz_bridge]: Creating GZ->ROS Bridge: [/camera (gz.msgs.Image) -> /camera (sensor_msgs/msg/Image)] (Lazy 0)
[parameter_bridge-2] [WARN] [1671665552.325729472] [ros_gz_bridge]: Failed to create a bridge for topic [/camera] with ROS2 type [/camera] to topic [sensor_msgs/msg/Image] with Gazebo Transport type [gz.msgs.Image]
[parameter_bridge-2] [INFO] [1671665552.325810129] [ros_gz_bridge]: Creating GZ->ROS Bridge: [/camera_info (gz.msgs.CameraInfo) -> /camera_info (sensor_msgs/msg/CameraInfo)] (Lazy 0)
[parameter_bridge-2] [WARN] [1671665552.325837714] [ros_gz_bridge]: Failed to create a bridge for topic [/camera_info] with ROS2 type [/camera_info] to topic [sensor_msgs/msg/CameraInfo] with Gazebo Transport type [gz.msgs.CameraInfo]
[ruby $(which gz) sim-1] QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-asfoe'
[rviz2-3] [INFO] [1671665552.481120863] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-3] [INFO] [1671665552.481228825] [rviz2]: OpenGl version: 4.6 (GLSL 4.6)
[rviz2-3] [INFO] [1671665552.501067288] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-3] [INFO] [1671665552.619186883] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-3] [INFO] [1671665552.628231068] [rviz2]: Stereo is NOT SUPPORTED
So i think i see the same problem as you.
Solution:
Either roll back to use ignition.msgs (see fork) or somehow make gz.msgs work.
i tried this by changing my launch file to use the other datatypes as above... there is no error at least, but the image viewer is still empty.
[INFO] [launch]: All log files can be found below /home/asfoe/.ros/log/2022-12-21-23-51-07-669495-asfoe-t14-968779
[INFO] [launch]: Default logging verbosity is set to INFO
[INFO] [parameter_bridge-1]: process started with pid [969079]
[INFO] [rviz2-2]: process started with pid [969081]
[rviz2-2] QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-asfoe'
[parameter_bridge-1] [INFO] [1671666667.894887696] [ros_gz_bridge]: Creating GZ->ROS Bridge: [/camera (ignition.msgs.Image) -> /camera (sensor_msgs/msg/Image)] (Lazy 0)
[parameter_bridge-1] [INFO] [1671666667.899576446] [ros_gz_bridge]: Creating ROS->GZ Bridge: [/camera (sensor_msgs/msg/Image) -> /camera (ignition.msgs.Image)] (Lazy 0)
[parameter_bridge-1] [INFO] [1671666667.902008043] [ros_gz_bridge]: Creating GZ->ROS Bridge: [/camera_info (ignition.msgs.CameraInfo) -> /camera_info (sensor_msgs/msg/CameraInfo)] (Lazy 0)
[parameter_bridge-1] [INFO] [1671666667.903179776] [ros_gz_bridge]: Creating ROS->GZ Bridge: [/camera_info (sensor_msgs/msg/CameraInfo) -> /camera_info (ignition.msgs.CameraInfo)] (Lazy 0)
[rviz2-2] [INFO] [1671666668.181093194] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-2] [INFO] [1671666668.181246339] [rviz2]: OpenGl version: 4.6 (GLSL 4.6)
[rviz2-2] [INFO] [1671666668.206359034] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-2] [INFO] [1671666668.404316147] [rviz2]: Stereo is NOT SUPPORTED
[rviz2-2] [INFO] [1671666668.428308716] [rviz2]: Stereo is NOT SUPPORTED
humble branch should support gz sim 6 (Fortress).
Where is this specified in the humble or ignition docs?
effectively this means that ignition garden and ros2 humble are broken @tfoote.
Based on timing of the report this looks like it is a regression since the latest release.
https://discourse.ros.org/t/new-packages-for-ros-2-humble-hawksbill-2022-12-16/28806
@audrow @azeey FYI
i tried this by changing my launch file to use the other datatypes as above... there is no error at least, but the image viewer is still empty.
I tried with my fork (https://github.com/c-rizz/ros_gz/tree/humble) in a clean workspace and it seems to work fine for me. Rqt correctly shows the image.
Where is this specified in the humble or ignition docs?
Not exactly sure how this is supposed to work, but the table at the beginning of the repo's README says the humble binaries at https://packages.ros.org/ support fortress. And the package.xml of ros_gz_sim by default depends on fortress on the humble branch ros_gz/ros_gz_sim/package.xml
PS: sorry for closing and reopening, I pressed by mistake...
I have confirmed that this is broken. The humble
branch should be compatible with fortress
and garden
, and that compatibility was broken. I'm opening a PR to fix.
This was caused by the bridge only recognizing ignition.
prefixed message definitions. I adjusted the bridge to also recognize gz.
in #349 , which will make this branch compatible with more versions of gazebo without issue.
Closed by #349
Hello, I'm just starting with ROS2 and the new gazebo, so I have been trying the demos, but they don't seem to work (which makes all quite a bit confusing for a new user of both things). I managed to make them work, the issue seems to be the use of gz.msgs on Humble/Fortress/IgnitionGazebo6.
Environment
Description
Steps to reproduce
Launch 'ros2 launch ros_gz_sim_demos tf_bridge.launch.py'
Output
Solution:
Either roll back to use ignition.msgs (see fork) or somehow make gz.msgs work.