Skip to content

Commit

Permalink
Update TimeSynchronizer usage example. (#115)
Browse files Browse the repository at this point in the history
  • Loading branch information
rkeating-planted authored Mar 8, 2024
1 parent b76a5ec commit 1deac90
Showing 1 changed file with 3 additions and 2 deletions.
5 changes: 3 additions & 2 deletions index.rst
Original file line number Diff line number Diff line change
Expand Up @@ -36,8 +36,9 @@ Using the time synchronizer::
assert image.header.stamp == camerainfo.header.stamp
print("got an Image and CameraInfo")

tss = TimeSynchronizer(Subscriber(node_object, sensor_msgs.msg.Image, "/wide_stereo/left/image_rect_color"),
Subscriber(node_object, sensor_msgs.msg.CameraInfo, "/wide_stereo/left/camera_info"))
tss = TimeSynchronizer([Subscriber(node_object, sensor_msgs.msg.Image, "/wide_stereo/left/image_rect_color"),
Subscriber(node_object, sensor_msgs.msg.CameraInfo, "/wide_stereo/left/camera_info")],
queue_size=10)
tss.registerCallback(gotimage)

Another example for syncronizing one image topic and one pointcloud2 topic using approximate synchronizer::
Expand Down

0 comments on commit 1deac90

Please sign in to comment.