30 #ifndef VORONOISEGMENTVISUAL_H 31 #define VORONOISEGMENTVISUAL_H 33 #include <tuw_multi_robot_msgs/Graph.h> 34 #include <geometry_msgs/Vector3.h> 73 void setMessage(
const tuw_multi_robot_msgs::Graph::ConstPtr& msg );
80 void setFramePosition(
const Ogre::Vector3& position );
81 void setFrameOrientation(
const Ogre::Quaternion& orientation );
85 void setPathColor( Ogre::ColourValue color );
86 void setPathScale (
float scale );
101 std::vector<boost::shared_ptr<rviz::Line> >
pathLine;
121 #endif // IMU_VISUAL_H
std::vector< boost::shared_ptr< rviz::Line > > pathLine
Ogre::SceneManager * scene_manager_
Ogre::SceneNode * frame_node_
TFSIMD_FORCE_INLINE Vector3()
Ogre::ColourValue colorPath_