Classes | |
class | ConvertMetricNodelet |
class | CropForemostNodelet |
struct | DepthTraits |
struct | DepthTraits< float > |
struct | DepthTraits< uint16_t > |
class | DisparityNodelet |
class | OccupancyXyzNodelet |
class | PointCloudXyziNodelet |
class | PointCloudXyziRadialNodelet |
class | PointCloudXyzNodelet |
class | PointCloudXyzRadialNodelet |
class | PointCloudXyzrgbNodelet |
class | RegisterNodelet |
Typedefs | |
typedef sensor_msgs::PointCloud2 | PointCloud |
typedef ExactTime< sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo > | SyncPolicy |
Functions | |
template<typename T > | |
void | convert (const sensor_msgs::ImageConstPtr &depth_msg, PointCloud::Ptr &cloud_msg, const image_geometry::PinholeCameraModel &model, double range_max=0.0) |
cv::Mat | initMatrix (cv::Mat cameraMatrix, cv::Mat distCoeffs, int width, int height, bool radial) |
typedef sensor_msgs::PointCloud2 xiaoqiang_depth_image_proc::PointCloud |
Definition at line 46 of file depth_conversions.h.
typedef ExactTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> xiaoqiang_depth_image_proc::SyncPolicy |
Definition at line 52 of file point_cloud_xyzi_radial.cpp.
void xiaoqiang_depth_image_proc::convert | ( | const sensor_msgs::ImageConstPtr & | depth_msg, |
PointCloud::Ptr & | cloud_msg, | ||
const image_geometry::PinholeCameraModel & | model, | ||
double | range_max = 0.0 |
||
) |
Definition at line 50 of file depth_conversions.h.
cv::Mat xiaoqiang_depth_image_proc::initMatrix | ( | cv::Mat | cameraMatrix, |
cv::Mat | distCoeffs, | ||
int | width, | ||
int | height, | ||
bool | radial | ||
) |
Definition at line 81 of file point_cloud_xyz_radial.cpp.