36 #include <nav_msgs/Path.h> 60 PathVisual( Ogre::SceneManager* scene_manager, Ogre::SceneNode* parent_node );
66 void setMessage(
const nav_msgs::Path::ConstPtr& msg );
73 void setFramePosition(
const Ogre::Vector3& position );
74 void setFrameOrientation(
const Ogre::Quaternion& orientation );
78 void setPathColor( Ogre::ColourValue color );
79 void setOrientColor( Ogre::ColourValue color );
87 void setPathScale(
float scale );
88 void setOrientScale(
float scale );
90 void setOrientDeltaS(
double deltaS );
121 #endif // PATH_VISUAL_H
Ogre::ColourValue colorPath_
rviz::Shape::Type shape_type_
TFSIMD_FORCE_INLINE Vector3()
Ogre::SceneNode * frame_node_
std::vector< boost::shared_ptr< rviz::Shape > > pathPtsXY_
std::vector< boost::shared_ptr< rviz::Arrow > > pathPtsTheta_
Ogre::ColourValue colorOrient_
Ogre::SceneManager * scene_manager_