#include <point_cloud.h>
Static Public Member Functions | |
static ros::Time * | pointer (pcl::PointCloud< pcl::PointXYZ > &m) |
static ros::Time const * | pointer (const pcl::PointCloud< pcl::PointXYZ > &m) |
static ros::Time | value (const pcl::PointCloud< pcl::PointXYZ > &m) |
Static Private Attributes | |
static boost::shared_ptr < std_msgs::Header > | header_ |
static boost::shared_ptr < std_msgs::Header > | header_const_ |
Definition at line 117 of file point_cloud.h.
static ros::Time* ros::message_traits::TimeStamp< pcl::PointCloud< pcl::PointXYZ > >::pointer | ( | pcl::PointCloud< pcl::PointXYZ > & | m | ) | [inline, static] |
Definition at line 124 of file point_cloud.h.
static ros::Time const* ros::message_traits::TimeStamp< pcl::PointCloud< pcl::PointXYZ > >::pointer | ( | const pcl::PointCloud< pcl::PointXYZ > & | m | ) | [inline, static] |
Definition at line 129 of file point_cloud.h.
static ros::Time ros::message_traits::TimeStamp< pcl::PointCloud< pcl::PointXYZ > >::value | ( | const pcl::PointCloud< pcl::PointXYZ > & | m | ) | [inline, static] |
Definition at line 134 of file point_cloud.h.
boost::shared_ptr<std_msgs::Header> ros::message_traits::TimeStamp< pcl::PointCloud< pcl::PointXYZ > >::header_ [static, private] |
Definition at line 138 of file point_cloud.h.
boost::shared_ptr<std_msgs::Header> ros::message_traits::TimeStamp< pcl::PointCloud< pcl::PointXYZ > >::header_const_ [static, private] |
Definition at line 139 of file point_cloud.h.