Classes | |
class | ConvertMetricNodelet |
struct | DepthTraits |
struct | DepthTraits< float > |
struct | DepthTraits< uint16_t > |
class | DisparityNodelet |
class | PointCloudXyzNodelet |
class | PointCloudXyzrgbNodelet |
class | RegisterNodelet |
union | RGBValue |
Functions | |
template<typename T > | |
void | convert (const sensor_msgs::ImageConstPtr &depth_msg, pcl::PointCloud< pcl::PointXYZ >::Ptr &cloud_msg, const image_geometry::PinholeCameraModel &model, double range_max=0.0) |
void depth_image_proc::convert | ( | const sensor_msgs::ImageConstPtr & | depth_msg, |
pcl::PointCloud< pcl::PointXYZ >::Ptr & | cloud_msg, | ||
const image_geometry::PinholeCameraModel & | model, | ||
double | range_max = 0.0 |
||
) |
Definition at line 48 of file depth_conversions.h.