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