Skip to content

Commit

Permalink
Updated Python docs (#150)
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
  • Loading branch information
ahcorde authored Oct 17, 2024
1 parent a5412ec commit 361e42c
Showing 1 changed file with 3 additions and 3 deletions.
6 changes: 3 additions & 3 deletions doc/index.rst
Original file line number Diff line number Diff line change
Expand Up @@ -10,7 +10,7 @@ at some time in the future, depending on a policy defined for that filter.

The filters currently implemented in this package are:

* :class:`message_filters.Subscriber` A source filter, which wraps a ROS 2 subscription. Most filter chains will begin with a Subscriber.
* :class:`message_filters.Subscriber` A source filter, which wraps a ROS 2 subscription. Most filter chains will begin with a Subscriber.
* :class:`message_filters.Cache` Caches messages which pass through it, allowing later lookup by time stamp.
* :class:`message_filters.TimeSynchronizer` Synchronizes multiple messages by their timestamps, only passing them through when all have arrived.
* :class:`message_filters.TimeSequencer` Tries to pass messages through ordered by their timestamps, even if some arrive out of order.
Expand Down Expand Up @@ -70,7 +70,7 @@ or

.. code-block:: Python
sub = message_filters.Subscriber("pose_topic", robot_msgs.msg.Pose)
sub = message_filters.Subscriber(node_object, "pose_topic", robot_msgs.msg.Pose)
sub.registerCallback(myCallback)
3. Time Synchronizer
Expand Down Expand Up @@ -140,7 +140,7 @@ Output:
~~~~~~~~~~~~~~~~~~~~
.. code-block:: Python
sub = message_filters.Subscriber('my_topic', sensor_msgs.msg.Image)
sub = message_filters.Subscriber(node_object, 'my_topic', sensor_msgs.msg.Image)
cache = message_filters.Cache(sub, 100)
In this example, the Cache stores the last 100 messages received on ``my_topic``, and ``myCallback`` is called on the addition of every new message. The user can then make calls like ``cache.getInterval(start, end)`` to extract part of the cache.
Expand Down

0 comments on commit 361e42c

Please sign in to comment.