36 #ifndef DEPTH_TO_POINTCLOUD_H_ 37 #define DEPTH_TO_POINTCLOUD_H_ 39 #include <sensor_msgs/CameraInfo.h> 40 #include <sensor_msgs/Image.h> 51 void initialize(sensor_msgs::ImageConstPtr depth_msg,
52 sensor_msgs::CameraInfoConstPtr camera_info_msg);
54 template<
typename Po
int2D_T,
typename Po
int3D_T>
std::vector< float > projection_map_x_
virtual ~DepthToPointCloud()
void depthTo3DPoint(Point2D_T &image_pos, float depth, Point3D_T &point)
void initialize(sensor_msgs::ImageConstPtr depth_msg, sensor_msgs::CameraInfoConstPtr camera_info_msg)
std::vector< float > projection_map_y_