39 #include <boost/thread.hpp>
66 void depthCb(
const sensor_msgs::ImageConstPtr& depth_msg,
67 const sensor_msgs::CameraInfoConstPtr& info_msg);
102 const sensor_msgs::CameraInfoConstPtr& info_msg)
105 cloud_msg->header = depth_msg->header;
106 cloud_msg->height = depth_msg->height;
107 cloud_msg->width = depth_msg->width;
108 cloud_msg->is_dense =
false;
109 cloud_msg->is_bigendian =
false;
117 if (depth_msg->encoding == enc::TYPE_16UC1 || depth_msg->encoding == enc::MONO16)
119 convert<uint16_t>(depth_msg, cloud_msg,
model_);
121 else if (depth_msg->encoding == enc::TYPE_32FC1)
123 convert<float>(depth_msg, cloud_msg,
model_);