rviz_interaction_tools::MeshObject Class Reference

#include <mesh_object.h>

List of all members.

Classes

struct  Point

Public Member Functions

void clear ()
Ogre::Entity * getEntity ()
void loadMesh (std::string name, const std::vector< Point > &vertices, const std::vector< unsigned > triangles=std::vector< unsigned >())
void loadMesh (std::string name, const geometric_shapes_msgs::Shape &mesh)
void loadPoints (std::string name, const std::vector< geometry_msgs::Point32 > &points)
 MeshObject (Ogre::SceneManager *scene_manager, Ogre::SceneNode *scene_root)
void setMaterialName (std::string name)
void setPose (const geometry_msgs::Pose &pose)
void setVisible (bool visible)
 ~MeshObject ()

Private Member Functions

 MeshObject (const MeshObject &)
MeshObjectoperator= (const MeshObject &)

Private Attributes

Ogre::Entity * entity_
Ogre::MeshPtr mesh_ptr_
Ogre::SceneManager * scene_manager_
Ogre::SceneNode * scene_node_
Ogre::SceneNode * scene_root_

Detailed Description

Definition at line 46 of file mesh_object.h.


Constructor & Destructor Documentation

rviz_interaction_tools::MeshObject::MeshObject ( Ogre::SceneManager *  scene_manager,
Ogre::SceneNode *  scene_root 
)

Definition at line 41 of file mesh_object.cpp.

rviz_interaction_tools::MeshObject::~MeshObject (  ) 

Definition at line 49 of file mesh_object.cpp.

rviz_interaction_tools::MeshObject::MeshObject ( const MeshObject  )  [private]

Member Function Documentation

void rviz_interaction_tools::MeshObject::clear (  ) 

Definition at line 55 of file mesh_object.cpp.

Ogre::Entity* rviz_interaction_tools::MeshObject::getEntity (  )  [inline]

Definition at line 74 of file mesh_object.h.

void rviz_interaction_tools::MeshObject::loadMesh ( std::string  name,
const std::vector< Point > &  vertices,
const std::vector< unsigned >  triangles = std::vector<unsigned>() 
)

Definition at line 165 of file mesh_object.cpp.

void rviz_interaction_tools::MeshObject::loadMesh ( std::string  name,
const geometric_shapes_msgs::Shape &  mesh 
)

Definition at line 89 of file mesh_object.cpp.

void rviz_interaction_tools::MeshObject::loadPoints ( std::string  name,
const std::vector< geometry_msgs::Point32 > &  points 
)

Definition at line 145 of file mesh_object.cpp.

MeshObject& rviz_interaction_tools::MeshObject::operator= ( const MeshObject  )  [private]
void rviz_interaction_tools::MeshObject::setMaterialName ( std::string  name  ) 

Definition at line 78 of file mesh_object.cpp.

void rviz_interaction_tools::MeshObject::setPose ( const geometry_msgs::Pose &  pose  ) 

Definition at line 83 of file mesh_object.cpp.

void rviz_interaction_tools::MeshObject::setVisible ( bool  visible  ) 

Definition at line 72 of file mesh_object.cpp.


Member Data Documentation

Definition at line 85 of file mesh_object.h.

Definition at line 84 of file mesh_object.h.

Definition at line 87 of file mesh_object.h.

Definition at line 83 of file mesh_object.h.

Definition at line 88 of file mesh_object.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines


rviz_interaction_tools
Author(s): David Gossow
autogenerated on Fri Jan 11 09:34:12 2013