ros2 / rviz

ROS 3D Robot Visualizer
BSD 3-Clause Clear License
296 stars 212 forks source link

Camera not showing geometry #1180

Closed mkatliar closed 5 months ago

mkatliar commented 5 months ago

To reproduce:

ros2 run rviz2 rviz2 -d camera.rviz & \
ros2 run v4l2_camera v4l2_camera_node --ros-args -p camera_info_url:=file://$(pwd)/camera_info.yaml & \
ros2 run tf2_ros static_transform_publisher --frame-id map --child-frame-id camera --z 3

image

The camera is looking at the grid from above. I expect it to render the grid and the map coordinate frame, or at least the dark empty space, but only the overlay image from the /image_row topic appears.

Tested on humble, iron.

rviz_camera_test.zip

mkatliar commented 5 months ago

The issue is gone after a recent update.