#include <point_cloud_common.h>
Public Member Functions | |
void | clear () |
CloudInfo () | |
~CloudInfo () | |
Public Attributes | |
boost::shared_ptr< PointCloud > | cloud_ |
Ogre::SceneManager * | manager_ |
sensor_msgs::PointCloud2ConstPtr | message_ |
Ogre::Quaternion | orientation_ |
Ogre::Vector3 | position_ |
ros::Time | receive_time_ |
Ogre::SceneNode * | scene_node_ |
PointCloudSelectionHandlerPtr | selection_handler_ |
std::vector< PointCloud::Point > | transformed_points_ |
Definition at line 89 of file point_cloud_common.h.
Definition at line 291 of file point_cloud_common.cpp.
Definition at line 296 of file point_cloud_common.cpp.
Definition at line 301 of file point_cloud_common.cpp.
boost::shared_ptr<PointCloud> rviz::PointCloudCommon::CloudInfo::cloud_ |
Definition at line 104 of file point_cloud_common.h.
Ogre::SceneManager* rviz::PointCloudCommon::CloudInfo::manager_ |
Definition at line 99 of file point_cloud_common.h.
sensor_msgs::PointCloud2ConstPtr rviz::PointCloudCommon::CloudInfo::message_ |
Definition at line 101 of file point_cloud_common.h.
Ogre::Quaternion rviz::PointCloudCommon::CloudInfo::orientation_ |
Definition at line 109 of file point_cloud_common.h.
Ogre::Vector3 rviz::PointCloudCommon::CloudInfo::position_ |
Definition at line 110 of file point_cloud_common.h.
Definition at line 97 of file point_cloud_common.h.
Ogre::SceneNode* rviz::PointCloudCommon::CloudInfo::scene_node_ |
Definition at line 103 of file point_cloud_common.h.
Definition at line 105 of file point_cloud_common.h.
Definition at line 107 of file point_cloud_common.h.