From 6fa12ae7ef3d7b215e0dbe7ca50bc1efea1a5981 Mon Sep 17 00:00:00 2001
From: navigation2-ci
Date: Mon, 26 Aug 2024 17:16:49 +0000
Subject: [PATCH] [skip ci] publish latest
Signed-off-by: navigation2-ci
---
_sources/setup_guides/sensors/setup_sensors.rst.txt | 2 +-
setup_guides/sensors/setup_sensors.html | 2 +-
2 files changed, 2 insertions(+), 2 deletions(-)
diff --git a/_sources/setup_guides/sensors/setup_sensors.rst.txt b/_sources/setup_guides/sensors/setup_sensors.rst.txt
index 0418a4264..25ad203cd 100644
--- a/_sources/setup_guides/sensors/setup_sensors.rst.txt
+++ b/_sources/setup_guides/sensors/setup_sensors.rst.txt
@@ -18,7 +18,7 @@ Aside from the ``sensor_msgs`` package, there are also the ``radar_msgs`` and ``
.. seealso::
For more information, see the API documentation of `sensor_msgs `_, `radar_msgs `_, and `vision_msgs `_.
-Your physical robot's sensors probably have ROS drivers written for them (e.g. a ROS node that connects to the sensors, populates data into messages, and publishes them for your robot to use) that follow the standard interface in the ``sensor_msgs`` package. The ``sensor_msgs`` package makes it easy for you to use many different sensors from different manufacturers. General software packages like Nav2 can then can read these standardized messages and perform tasks independent of the sensor hardware. On simulated robots such as ``sam_bot``, Gazebo has sensor plugins which also publish their information following the ``sensor_msgs`` package.
+Your physical robot's sensors probably have ROS drivers written for them (e.g. a ROS node that connects to the sensors, populates data into messages, and publishes them for your robot to use) that follow the standard interface in the ``sensor_msgs`` package. The ``sensor_msgs`` package makes it easy for you to use many different sensors from different manufacturers. General software packages like Nav2 can then read these standardized messages and perform tasks independent of the sensor hardware. On simulated robots such as ``sam_bot``, Gazebo has sensor plugins which also publish their information following the ``sensor_msgs`` package.
Common Sensor Messages
======================
diff --git a/setup_guides/sensors/setup_sensors.html b/setup_guides/sensors/setup_sensors.html
index 279c04095..b7a8f9060 100644
--- a/setup_guides/sensors/setup_sensors.html
+++ b/setup_guides/sensors/setup_sensors.html
@@ -1105,7 +1105,7 @@ Sensor Introduction
For more information, see the API documentation of sensor_msgs, radar_msgs, and vision_msgs.
-Your physical robot’s sensors probably have ROS drivers written for them (e.g. a ROS node that connects to the sensors, populates data into messages, and publishes them for your robot to use) that follow the standard interface in the sensor_msgs
package. The sensor_msgs
package makes it easy for you to use many different sensors from different manufacturers. General software packages like Nav2 can then can read these standardized messages and perform tasks independent of the sensor hardware. On simulated robots such as sam_bot
, Gazebo has sensor plugins which also publish their information following the sensor_msgs
package.
+Your physical robot’s sensors probably have ROS drivers written for them (e.g. a ROS node that connects to the sensors, populates data into messages, and publishes them for your robot to use) that follow the standard interface in the sensor_msgs
package. The sensor_msgs
package makes it easy for you to use many different sensors from different manufacturers. General software packages like Nav2 can then read these standardized messages and perform tasks independent of the sensor hardware. On simulated robots such as sam_bot
, Gazebo has sensor plugins which also publish their information following the sensor_msgs
package.
Common Sensor Messages
In this subsection, we discuss some of the common types of sensor_msgs
you might encounter when setting up Nav2. We will provide a brief description for each sensor, an image of it being simulated in Gazebo and the corresponding visualization of the sensor readings in RViz.