Skip to content

Commit 439e9a5

Browse files
committed
Update setup_robot_localization.rst
Changed node name and config file to ekf_filter_node for consistency Signed-off-by: seatoad <cindysongh@gmail.com>
1 parent 9f4ece2 commit 439e9a5

File tree

1 file changed

+4
-4
lines changed

1 file changed

+4
-4
lines changed

setup_guides/odom/setup_robot_localization.rst

Lines changed: 4 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -36,7 +36,7 @@ Next, we specify the parameters of the ``ekf_node`` using a YAML file. Create a
3636
.. code-block:: yaml
3737
3838
### ekf config file ###
39-
ekf_node:
39+
ekf_filter_node:
4040
ros__parameters:
4141
# The frequency, in Hz, at which the filter will output a position estimate. Note that the filter will not begin
4242
# computation until it receives at least one message from one of the inputs. It will then run continuously at the
@@ -103,7 +103,7 @@ Now, let us add the ``ekf_node`` into the launch file. Open ``launch/display.lau
103103
robot_localization_node = Node(
104104
package='robot_localization',
105105
executable='ekf_node',
106-
name='ekf_node',
106+
name='ekf_filter_node',
107107
output='screen',
108108
parameters=[os.path.join(pkg_share, 'config/ekf.yaml'), {'use_sim_time': LaunchConfiguration('use_sim_time')}]
109109
)
@@ -179,13 +179,13 @@ To verify that the ``ekf_node`` are the subscribers of these topics, execute:
179179

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

186186
.. code-block:: shell
187187
188-
/ekf_node
188+
/ekf_filter_node
189189
Subscribers:
190190
/demo/imu: sensor_msgs/msg/Imu
191191
/demo/odom: nav_msgs/msg/Odometry

0 commit comments

Comments
 (0)