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
Copy file name to clipboardExpand all lines: doc/release_notes.rst
+1Lines changed: 1 addition & 0 deletions
Display the source diff
Display the rich diff
Original file line number
Diff line number
Diff line change
@@ -11,6 +11,7 @@ chained_filter_controller
11
11
force_torque_sensor_broadcaster
12
12
*******************************
13
13
* Multiplier support was added. Users can now specify per–axis scaling factors for both force and torque readings, applied after the existing offset logic. (`#1647 <https://github.com/ros-controls/ros2_controllers/pull/1647/files>`__).
14
+
* Added support for filter chains, allowing users to configure a sequence of filter plugins with their parameters. The force/torque sensor readings are filtered sequentially and published on a separate topic.
Copy file name to clipboardExpand all lines: force_torque_sensor_broadcaster/doc/userdoc.rst
+10-1Lines changed: 10 additions & 1 deletion
Display the source diff
Display the rich diff
Original file line number
Diff line number
Diff line change
@@ -7,8 +7,11 @@ Force Torque Sensor Broadcaster
7
7
Broadcaster of messages from force/torque state interfaces of a robot or sensor.
8
8
The published message type is ``geometry_msgs/msg/WrenchStamped``.
9
9
10
-
The controller is a wrapper around ``ForceTorqueSensor`` semantic component (see ``controller_interface`` package).
10
+
The broadcaster also supports filtering the force/torque readings using a filter chain, enabling the sequential application of multiple filters. In this case, an additional topic with the
11
+
``_filtered`` suffix will be published containing the final result. For more details on filters, refer to the `filters package repository <https://github.com/ros/filters>`_.
12
+
See the parameter section for instructions on configuring a filter chain with an arbitrary number of filters.
11
13
14
+
The controller is a wrapper around ``ForceTorqueSensor`` semantic component (see ``controller_interface`` package).
12
15
13
16
Parameters
14
17
^^^^^^^^^^^
@@ -17,6 +20,12 @@ This controller uses the `generate_parameter_library <https://github.com/PickNik
17
20
The interfaces can be defined in two ways, using the ``sensor_name`` or the ``interface_names`` parameter:
18
21
Those two parameters cannot be defined at the same time.
19
22
23
+
The filter chain is configured as a sequential list of filters under the ``sensor_filter_chain`` parameter, where each filter is identified by the key ``filterN``, with ``N`` representing its position in the chain (e.g., ``filter1``, ``filter2``, etc.).
24
+
Each filter entry must specify the ``name`` and ``type`` of the plugin, along with any additional parameters required by that specific filter plugin. The chain will use the `pluginlib <https://github.com/ros/pluginlib>`_ library to load each filter at runtime,
25
+
passing the specified parameters.
26
+
27
+
The chain processes the data sequentially, passing the output of one filter as the input to the next.
Copy file name to clipboardExpand all lines: force_torque_sensor_broadcaster/include/force_torque_sensor_broadcaster/force_torque_sensor_broadcaster.hpp
0 commit comments