#include <point_cloud.h>
Static Public Member Functions | |
static ros::Time * | pointer (typename pcl::PointCloud< T > &m) |
static ros::Time const * | pointer (const typename pcl::PointCloud< T > &m) |
static ros::Time | value (const typename pcl::PointCloud< T > &m) |
Static Private Attributes | |
static boost::shared_ptr < std_msgs::Header > | header_ |
static boost::shared_ptr < std_msgs::Header > | header_const_ |
Definition at line 118 of file point_cloud.h.
static ros::Time* ros::message_traits::TimeStamp< pcl::PointCloud< T > >::pointer | ( | typename pcl::PointCloud< T > & | m | ) | [inline, static] |
Definition at line 125 of file point_cloud.h.
static ros::Time const* ros::message_traits::TimeStamp< pcl::PointCloud< T > >::pointer | ( | const typename pcl::PointCloud< T > & | m | ) | [inline, static] |
Definition at line 130 of file point_cloud.h.
static ros::Time ros::message_traits::TimeStamp< pcl::PointCloud< T > >::value | ( | const typename pcl::PointCloud< T > & | m | ) | [inline, static] |
Definition at line 135 of file point_cloud.h.
boost::shared_ptr<std_msgs::Header> ros::message_traits::TimeStamp< pcl::PointCloud< T > >::header_ [static, private] |
Definition at line 139 of file point_cloud.h.
boost::shared_ptr<std_msgs::Header> ros::message_traits::TimeStamp< pcl::PointCloud< T > >::header_const_ [static, private] |
Definition at line 140 of file point_cloud.h.