There are three toROSMsg functions, converting input to sensor_msgs::Image output, in pcl_conversions.h
All these functions do not assign the header of the sensor_msgs::Image output variable unlike other conversion functions that convert to sensor_msgs::PointCloud2 in this file:
toROSMsg at line #506: does conversion of the data, but does not assign the header of the output.
toROSMsg at lines #486, #496: depend on pcl::toPCLPointCloud2 function of pcl library. This library function too does not set their output variable's header.
Would really appreciate if you can explain why the header (frame_id) of the image is not set? Should the frame of the output image be same as the input point cloud?
There are three
toROSMsg
functions, converting input tosensor_msgs::Image
output, in pcl_conversions.hAll these functions do not assign the header of the
sensor_msgs::Image
output variable unlike other conversion functions that convert tosensor_msgs::PointCloud2
in this file:toROSMsg
at line #506: does conversion of the data, but does not assign the header of the output.toROSMsg
at lines #486, #496: depend onpcl::toPCLPointCloud2
function of pcl library. This library function too does not set their output variable's header.Would really appreciate if you can explain why the header (
frame_id
) of the image is not set? Should the frame of the output image be same as the input point cloud?Thank you!