From 999d961a0ef39d18d6cf12830f61a7c61506de0b Mon Sep 17 00:00:00 2001 From: Michael Ferguson Date: Fri, 16 Aug 2024 07:38:37 -0400 Subject: [PATCH] fix signature issue from #943 (#1018) Without this, we get ``` symbol lookup error: /home/ubr/jazzy/install/depth_image_proc/lib/libdepth_image_proc.so: undefined symbol: _ZN16depth_image_proc10convertRgbERKSt10shared_ptrIKN11sensor_msgs3msg6Image_ISaIvEEEES0_INS2_12PointCloud2_IS4_EEEiiii c++filt _ZN16depth_image_proc10convertRgbERKSt10shared_ptrIKN11sensor_msgs3msg6Image_ISaIvEEEES0_INS2_12PointCloud2_IS4_EEEiiii depth_image_proc::convertRgb(std::shared_ptr > const> const&, std::shared_ptr > >, int, int, int, int) ``` (cherry picked from commit a7c0b09c5e37fcaf7e3153e6d353687a793ee3f9) --- depth_image_proc/include/depth_image_proc/conversions.hpp | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/depth_image_proc/include/depth_image_proc/conversions.hpp b/depth_image_proc/include/depth_image_proc/conversions.hpp index 8af177bd0..a8f0e53c6 100644 --- a/depth_image_proc/include/depth_image_proc/conversions.hpp +++ b/depth_image_proc/include/depth_image_proc/conversions.hpp @@ -152,7 +152,7 @@ void convertIntensity( // Handles RGB8, BGR8, and MONO8 void convertRgb( const sensor_msgs::msg::Image::ConstSharedPtr & rgb_msg, - sensor_msgs::msg::PointCloud2::SharedPtr cloud_msg, + const sensor_msgs::msg::PointCloud2::SharedPtr & cloud_msg, int red_offset, int green_offset, int blue_offset, int color_step); cv::Mat initMatrix(cv::Mat cameraMatrix, cv::Mat distCoeffs, int width, int height, bool radial);