#include <depth_to_pointcloud.h>
Definition at line 45 of file depth_to_pointcloud.h.
DepthToPointCloud::DepthToPointCloud |
( |
| ) |
|
DepthToPointCloud::~DepthToPointCloud |
( |
| ) |
|
|
virtual |
template<typename Point2D_T , typename Point3D_T >
void DepthToPointCloud::depthTo3DPoint |
( |
Point2D_T & |
image_pos, |
|
|
float |
depth, |
|
|
Point3D_T & |
point |
|
) |
| |
|
inline |
void DepthToPointCloud::initialize |
( |
sensor_msgs::ImageConstPtr |
depth_msg, |
|
|
sensor_msgs::CameraInfoConstPtr |
camera_info_msg |
|
) |
| |
std::vector<float> DepthToPointCloud::projection_map_x_ |
|
protected |
std::vector<float> DepthToPointCloud::projection_map_y_ |
|
protected |
The documentation for this class was generated from the following files: