Skip to content

Commit e09e95e

Browse files
authored
Merge pull request #1 from coffinfish/coffinfish-patch-1
Update setup_robot_localization.rst
2 parents 11e0430 + 5a9f528 commit e09e95e

File tree

1 file changed

+5
-5
lines changed

1 file changed

+5
-5
lines changed

setup_guides/odom/setup_robot_localization.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -85,7 +85,7 @@ Next, we specify the parameters of the ``ekf_node`` using a YAML file. Create a
8585
8686
In this configuration, we defined the parameter values of ``frequency``, ``two_d_mode``, ``publish_acceleration``, ``publish_tf``, ``map_frame``, ``odom_frame``, ``base_link_frame``, and ``world_frame``. For more information on the other parameters you can modify, see `Parameters of state estimation nodes <http://docs.ros.org/en/melodic/api/robot_localization/html/state_estimation_nodes.html#parameters>`_, and a sample ``efk.yaml`` can be found `here <https://github.com/cra-ros-pkg/robot_localization/blob/ros2/params/ekf.yaml>`_.
8787

88-
To add a sensor input to the ``ekf_filter_node``, add the next number in the sequence to its base name (odom, imu, pose, twist). In our case, we have one ``nav_msgs/Odometry`` and one ``sensor_msgs/Imu`` as inputs to the filter, thus we use ``odom0`` and ``imu0``. We set the value of ``odom0`` to ``demo/odom``, which is the topic that publishes the ``nav_msgs/Odometry``. Similarly, we set the value of ``imu0`` to the topic that publishes ``sensor_msgs/Imu``, which is ``demo/imu``.
88+
To add a sensor input to the ``ekf_node``, add the next number in the sequence to its base name (odom, imu, pose, twist). In our case, we have one ``nav_msgs/Odometry`` and one ``sensor_msgs/Imu`` as inputs to the filter, thus we use ``odom0`` and ``imu0``. We set the value of ``odom0`` to ``demo/odom``, which is the topic that publishes the ``nav_msgs/Odometry``. Similarly, we set the value of ``imu0`` to the topic that publishes ``sensor_msgs/Imu``, which is ``demo/imu``.
8989

9090
To understand how ``robot_localization`` is configured and understand the reasoning behind the config have a look at `Configuring robot_localization <http://docs.ros.org/en/melodic/api/robot_localization/html/configuring_robot_localization.html>`_.
9191

@@ -175,17 +175,17 @@ You can also check the subscriber count of these topics again by executing:
175175
176176
You should see that ``/demo/imu`` and ``/demo/odom`` now both have 1 subscriber each.
177177

178-
To verify that the ``ekf_filter_node`` are the subscribers of these topics, execute:
178+
To verify that the ``ekf_node`` are the subscribers of these topics, execute:
179179

180180
.. code-block:: shell
181181
182-
ros2 node info /ekf_filter_node
182+
ros2 node info /ekf_node
183183
184184
You should see an output as shown below.
185185

186186
.. code-block:: shell
187187
188-
/ekf_filter_node
188+
/ekf_node
189189
Subscribers:
190190
/demo/imu: sensor_msgs/msg/Imu
191191
/demo/odom: nav_msgs/msg/Odometry
@@ -201,7 +201,7 @@ You should see an output as shown below.
201201
Service Servers:
202202
...
203203
204-
From the output above, we can see that the ``ekf_filter_node`` is subscribed to ``/demo/imu`` and ``/demo/odom``. We can also see that the ``ekf_filter_node`` publishes on the ``odometry/filtered``, ``accel/filtered``, and ``/tf`` topics.
204+
From the output above, we can see that the ``ekf_node`` is subscribed to ``/demo/imu`` and ``/demo/odom``. We can also see that the ``ekf_node`` publishes on the ``odometry/filtered``, ``accel/filtered``, and ``/tf`` topics.
205205

206206
You may also verify that ``robot_localization`` is publishing the ``odom`` => ``base_link`` transform by using the tf2_echo utility. Run the following command in a separate command line terminal:
207207

0 commit comments

Comments
 (0)