Namespaces | |
detail | |
gpu | |
io | |
tracking | |
Classes | |
class | DefaultPointRepresentation< pcl::tracking::ParticleCuboid > |
class | EarClippingPatched |
struct | PointHSV |
struct | PointRGB |
struct | PointXYZHSV |
Functions | |
void | concatenateFields (PointCloud< PointXYZ > &cloud_xyz, PointCloud< RGB > &cloud_rgb, PointCloud< PointXYZRGB > &cloud) |
bool | concatenatePointCloud (const sensor_msgs::PointCloud2 &cloud1, const sensor_msgs::PointCloud2 &cloud2, sensor_msgs::PointCloud2 &cloud_out) |
void | createMapping (const std::vector< sensor_msgs::PointField > &msg_fields, MsgFieldMap &field_map) |
void | fromROSMsg (const sensor_msgs::PointCloud2 &cloud, pcl::PointCloud< T > &pcl_cloud) |
int | getFieldIndex (const sensor_msgs::PointCloud2 &cloud, const std::string &field_name) |
std::string | getFieldsList (const sensor_msgs::PointCloud2 &cloud) |
void | moveFromROSMsg (sensor_msgs::PointCloud2 &cloud, pcl::PointCloud< T > &pcl_cloud) |
void | moveToROSMsg (sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image) |
void | PointCloudDepthAndRGBtoXYZRGBA (PointCloud< Intensity > &depth, PointCloud< RGB > &image, float &focal, PointCloud< PointXYZRGBA > &out) |
Convert registered Depth image and RGB image to PointCloudXYZRGBA. More... | |
void | PointCloudRGBtoI (PointCloud< RGB > &in, PointCloud< Intensity > &out) |
Convert a RGB point cloud to a Intensity. More... | |
void | PointCloudRGBtoI (PointCloud< RGB > &in, PointCloud< Intensity8u > &out) |
Convert a RGB point cloud to a Intensity. More... | |
void | PointCloudRGBtoI (PointCloud< RGB > &in, PointCloud< Intensity32u > &out) |
Convert a RGB point cloud to a Intensity. More... | |
void | PointCloudXYZRGBAtoXYZHSV (PointCloud< PointXYZRGBA > &in, PointCloud< PointXYZHSV > &out) |
Convert a XYZRGB point cloud to a XYZHSV. More... | |
void | PointCloudXYZRGBtoXYZHSV (PointCloud< PointXYZRGB > &in, PointCloud< PointXYZHSV > &out) |
Convert a XYZRGB point cloud to a XYZHSV. More... | |
void | PointCloudXYZRGBtoXYZI (PointCloud< PointXYZRGB > &in, PointCloud< PointXYZI > &out) |
Convert a XYZRGB point cloud to a XYZI. More... | |
void | PointRGBtoI (RGB &in, Intensity &out) |
Convert a RGB point type to a I. More... | |
void | PointRGBtoI (RGB &in, Intensity8u &out) |
Convert a RGB point type to a I. More... | |
void | PointRGBtoI (RGB &in, Intensity32u &out) |
Convert a RGB point type to a I. More... | |
void | PointXYZHSVtoXYZRGB (PointXYZHSV &in, PointXYZRGB &out) |
void | PointXYZRGBAtoXYZHSV (PointXYZRGBA &in, PointXYZHSV &out) |
Convert a XYZRGB point type to a XYZHSV. More... | |
void | PointXYZRGBtoXYZHSV (PointXYZRGB &in, PointXYZHSV &out) |
Convert a XYZRGB point type to a XYZHSV. More... | |
void | PointXYZRGBtoXYZI (PointXYZRGB &in, PointXYZI &out) |
Convert a XYZRGB point type to a XYZI. More... | |
void | toROSMsg (const pcl::PointCloud< T > &cloud, sensor_msgs::Image &msg) |
void | toROSMsg (const sensor_msgs::PointCloud2 &cloud, sensor_msgs::Image &image) |
void | toROSMsg (const pcl::PointCloud< T > &pcl_cloud, sensor_msgs::PointCloud2 &cloud) |
Variables | |
struct pcl::PointXYZHSV | EIGEN_ALIGN16 |
void pcl::concatenateFields | ( | PointCloud< PointXYZ > & | cloud_xyz, |
PointCloud< RGB > & | cloud_rgb, | ||
PointCloud< PointXYZRGB > & | cloud | ||
) |
Definition at line 58 of file kinfu_nodelet.cpp.
|
inline |
Convert registered Depth image and RGB image to PointCloudXYZRGBA.
[in] | depth | the input depth image as intensity points in float |
[in] | image | the input RGB image |
[in] | focal | the focal length |
[out] | out | the output pointcloud |
Definition at line 354 of file point_types_conversion.h.
|
inline |
Convert a RGB point cloud to a Intensity.
[in] | in | the input RGB point cloud |
[out] | out | the output Intensity point cloud |
Definition at line 244 of file point_types_conversion.h.
|
inline |
Convert a RGB point cloud to a Intensity.
[in] | in | the input RGB point cloud |
[out] | out | the output Intensity point cloud |
Definition at line 262 of file point_types_conversion.h.
|
inline |
Convert a RGB point cloud to a Intensity.
[in] | in | the input RGB point cloud |
[out] | out | the output Intensity point cloud |
Definition at line 280 of file point_types_conversion.h.
|
inline |
Convert a XYZRGB point cloud to a XYZHSV.
[in] | in | the input XYZRGB point cloud |
[out] | out | the output XYZHSV point cloud |
Definition at line 316 of file point_types_conversion.h.
|
inline |
Convert a XYZRGB point cloud to a XYZHSV.
[in] | in | the input XYZRGB point cloud |
[out] | out | the output XYZHSV point cloud |
Definition at line 298 of file point_types_conversion.h.
|
inline |
Convert a XYZRGB point cloud to a XYZI.
[in] | in | the input XYZRGB point cloud |
[out] | out | the output XYZI point cloud |
Definition at line 334 of file point_types_conversion.h.
|
inline |
Convert a RGB point type to a I.
[in] | in | the input RGB point |
[out] | out | the output Intensity point |
Definition at line 68 of file point_types_conversion.h.
|
inline |
Convert a RGB point type to a I.
[in] | in | the input RGB point |
[out] | out | the output Intensity point |
Definition at line 79 of file point_types_conversion.h.
|
inline |
Convert a RGB point type to a I.
[in] | in | the input RGB point |
[out] | out | the output Intensity point |
Definition at line 91 of file point_types_conversion.h.
|
inline |
Definition at line 176 of file point_types_conversion.h.
|
inline |
Convert a XYZRGB point type to a XYZHSV.
[in] | in | the input XYZRGB point |
[out] | out | the output XYZHSV point |
Definition at line 140 of file point_types_conversion.h.
|
inline |
Convert a XYZRGB point type to a XYZHSV.
[in] | in | the input XYZRGB point |
[out] | out | the output XYZHSV point |
Definition at line 103 of file point_types_conversion.h.
|
inline |
Convert a XYZRGB point type to a XYZI.
[in] | in | the input XYZRGB point |
[out] | out | the output XYZI point |
Definition at line 56 of file point_types_conversion.h.
struct pcl::PointRGB pcl::EIGEN_ALIGN16 |