Skip to content

Commit

Permalink
fix signature issue from #943 (backport #1018) (#1023)
Browse files Browse the repository at this point in the history
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<sensor_msgs::msg::Image_<std::allocator<void> > const> const&, std::shared_ptr<sensor_msgs::msg::PointCloud2_<std::allocator<void> > >, int, int, int, int)
```

This is an automatic backport of pull request #1018 done by
[Mergify](https://mergify.com).

Co-authored-by: Michael Ferguson <[email protected]>
  • Loading branch information
mergify[bot] and mikeferguson committed Aug 16, 2024
1 parent 3f94721 commit ac6707b
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion depth_image_proc/include/depth_image_proc/conversions.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -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);
Expand Down

0 comments on commit ac6707b

Please sign in to comment.