No image topic published on ROS1 (Dome ROS1 integration tutorial)

asked 2020-10-12 09:25:22 -0600

yah130s gravatar image

updated 2020-10-12 09:50:47 -0600

Running dome/ros_integration and I do not see a camera image on rqt_image_view. Any idea?

image description

I do not see rostopic being published (in the screenshot I cannot seem to delete the "/camera_mouse_left"...even after I deleted the text it comes back):

$ source /opt/ros/melodic/setup.bash && rostopic list
/camera
/rosout
/rosout_agg

$ rostopic hz /camera
subscribed to [/camera]
no new messages
no new messages

$ rostopic info /camera 
Type: geometry_msgs/Point

Publishers: 
 * /ros_ign_bridge (http://peasnoodle-p50:45839/)

Subscribers: 
 * /ros_ign_bridge (http://peasnoodle-p50:45839/)
 * /rqt_gui_cpp_node_16416 (http://peasnoodle-p50:35487/)

$ rosnode list
/ros_ign_bridge
/rosout
/rqt_gui_cpp_node_16416
$ rosnode info /ros_ign_bridge 
--------------------------------------------------------------------------------
Node [/ros_ign_bridge]
Publications: 
 * /camera [geometry_msgs/Point]
 * /rosout [rosgraph_msgs/Log]

Subscriptions: 
 * /camera [geometry_msgs/Point]

Services: 
 * /ros_ign_bridge/get_loggers
 * /ros_ign_bridge/set_logger_level

contacting node http://peasnoodle-p50:45839/ ...
Pid: 16347
Connections:
 * topic: /rosout
    * to: /rosout
    * direction: outbound (35841 - 127.0.0.1:45126) [37]
    * transport: TCPROS
 * topic: /camera
    * to: /ros_ign_bridge
    * direction: outbound
    * transport: INTRAPROCESS
 * topic: /camera
    * to: /rqt_gui_cpp_node_16416
    * direction: outbound (35841 - 127.0.0.1:45338) [40]
    * transport: TCPROS
 * topic: /camera
    * to: /ros_ign_bridge (http://peasnoodle-p50:45839/)
    * direction: inbound
    * transport: INTRAPROCESS

Btw, I'm struggling to use ign commandline tools to show topic status etc. I can't seem to find a good reference other than --help, which doesn't give me enough info.

$ ign topic -m ignition.msgs.Image
Command error: I do not have an implementation for this command.
$ ign topic -m @ignition.msgs.Image
Command error: I do not have an implementation for this command.
$ ign topic -l
/camera
/camera_info
/clock
/gazebo/resource_paths
/stats
/world/camera_sensor/clock
/world/camera_sensor/dynamic_pose/info
/world/camera_sensor/pose/info
/world/camera_sensor/scene/deletion
/world/camera_sensor/scene/info
/world/camera_sensor/state
/world/camera_sensor/stats
$ ign topic -m /camera
Command error: I do not have an implementation for this command.
$ ign topic -i /camera
ign topic --info: missing topic name (-t <topic>)
Try ign topic --help
$ ign topic -t /camera
Command error: I do not have an implementation for this command.
edit retag flag offensive close merge delete