#include <depth_to_pointcloud.h>
| Public Member Functions | |
| template<typename Point2D_T , typename Point3D_T > | |
| void | depthTo3DPoint (Point2D_T &image_pos, float depth, Point3D_T &point) | 
| DepthToPointCloud () | |
| void | initialize (sensor_msgs::ImageConstPtr depth_msg, sensor_msgs::CameraInfoConstPtr camera_info_msg) | 
| virtual | ~DepthToPointCloud () | 
| Protected Attributes | |
| std::vector< float > | projection_map_x_ | 
| std::vector< float > | projection_map_y_ | 
Definition at line 45 of file depth_to_pointcloud.h.
Definition at line 40 of file depth_to_pointcloud.cpp.
| DepthToPointCloud::~DepthToPointCloud | ( | ) |  [virtual] | 
Definition at line 46 of file depth_to_pointcloud.cpp.
| void DepthToPointCloud::depthTo3DPoint | ( | Point2D_T & | image_pos, | 
| float | depth, | ||
| Point3D_T & | point | ||
| ) |  [inline] | 
Definition at line 55 of file depth_to_pointcloud.h.
| void DepthToPointCloud::initialize | ( | sensor_msgs::ImageConstPtr | depth_msg, | 
| sensor_msgs::CameraInfoConstPtr | camera_info_msg | ||
| ) | 
Definition at line 51 of file depth_to_pointcloud.cpp.
| std::vector<float> DepthToPointCloud::projection_map_x_  [protected] | 
Definition at line 68 of file depth_to_pointcloud.h.
| std::vector<float> DepthToPointCloud::projection_map_y_  [protected] | 
Definition at line 69 of file depth_to_pointcloud.h.