From 165d24551f4b1a4031ba465d0b72aaa05736f36a Mon Sep 17 00:00:00 2001 From: Homalozoa Date: Fri, 25 Mar 2022 18:45:25 +0800 Subject: [PATCH] [Fix] Fix image_encodings.hpp's URL in README Signed-off-by: Homalozoa --- sensor_msgs/README.md | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/sensor_msgs/README.md b/sensor_msgs/README.md index af0daeb6..7385aaad 100644 --- a/sensor_msgs/README.md +++ b/sensor_msgs/README.md @@ -10,7 +10,7 @@ For more information about ROS 2 interfaces, see [docs.ros.org](https://docs.ros This package provides some common C++ functionality relating to manipulating a couple of particular sensor_msgs messages. * [fill_image.hpp](include/sensor_msgs/fill_image.hpp): Fill a Image message from type-erased data pointer. -* [image_encodings.hpp](include/sensor_msgs/image_encodings): Definitions and functionality relating to image encodings. +* [image_encodings.hpp](include/sensor_msgs/image_encodings.hpp): Definitions and functionality relating to image encodings. * [point_cloud_conversion.hpp](include/sensor_msgs/point_cloud_conversion.hpp): Functionality for converting between the deprecated PointCloud and PointCloud2 messages. * [point_cloud2_iterator.hpp](include/sensor_msgs/point_cloud2_iterator.hpp): Tools for modifying and parsing PointCloud2 messages. * [point_field_conversion.hpp](include/sensor_msgs/point_field_conversion.hpp): A type to enum mapping for the different PointField types, and methods to read and write in a PointCloud2 buffer for the different PointField types.