You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
When using the ros_gz_bridge package to connect Gazebo camera topics to ROS 2 for visualization, the bridge establishes but no data flows through. The camera topics exist in Gazebo and appear in ROS 2 after bridging, but no messages are received by ROS 2 subscribers. This prevents visualization and use of camera data in ROS 2 applications.
Description
When using the
ros_gz_bridge
package to connect Gazebo camera topics to ROS 2 for visualization, the bridge establishes but no data flows through. The camera topics exist in Gazebo and appear in ROS 2 after bridging, but no messages are received by ROS 2 subscribers. This prevents visualization and use of camera data in ROS 2 applications.Environment
Drone Model
Using
x500_depth
which includes the OakD-Lite camera:Steps to Reproduce
Start PX4 SITL with the depth camera model:
Verify camera topics exist in Gazebo:
gz topic -l | grep -i camera
Output includes:
Start the ROS-Gazebo bridge:
Check that ROS 2 topics are created:
Output includes:
Attempt to monitor message frequency:
No messages are detected.
Launch
rqt_image_view
and select the camera topics:Window appears but shows no images.
Error Messages
From the bridge:
When trying to use ros_gz_image:
Expected Behavior
rqt_image_view
should display the camera feed when selecting the appropriate topicActual Behavior
rqt_image_view
shows no imagesros2 topic hz
reports no messages receivedAttempted Solutions
parameter_bridge
with different topic configurationsros_gz_image
directly with the image topicssudo rm -rf /dev/shm/rtps*
sudo chmod 777 /dev/shm
Possible Related Issues
Any guidance or solutions to get the camera feed working properly would be greatly appreciated.
The text was updated successfully, but these errors were encountered: