Public Member Functions | Private Attributes | List of all members
tuw_nav_rviz_plugin::RouteSegmentsVisual Class Reference

#include <RouteSegmentsVisual.h>

Public Member Functions

 RouteSegmentsVisual (Ogre::SceneManager *scene_manager, Ogre::SceneNode *parent_node)
 
void setArcColor (Ogre::ColourValue color)
 
void setCenterPointColor (Ogre::ColourValue color)
 
void setCenterPointScale (float scale)
 
void setCenterPointShape (rviz::Shape::Type shape_type)
 
void setEndPointColor (Ogre::ColourValue color)
 
void setEndPointScale (float scale)
 
void setEndPointShape (rviz::Shape::Type shape_type)
 
void setFrameOrientation (const Ogre::Quaternion &orientation)
 
void setFramePosition (const Ogre::Vector3 &position)
 
void setLineColor (Ogre::ColourValue color)
 
void setMessage (const tuw_nav_msgs::RouteSegments::ConstPtr &msg)
 
void setShowArcs (bool visible)
 
void setShowCenterPoints (bool visible)
 
void setShowEndPoints (bool visible)
 
void setShowLines (bool visible)
 
void setShowStartPoints (bool visible)
 
void setStartPointColor (Ogre::ColourValue color)
 
void setStartPointScale (float scale)
 
void setStartPointShape (rviz::Shape::Type shape_type)
 
virtual ~RouteSegmentsVisual ()
 

Private Attributes

std::vector< boost::shared_ptr< rviz::Line > > arcs_
 
std::vector< boost::shared_ptr< rviz::Shape > > centerPts_
 
Ogre::ColourValue color_arcs_
 
Ogre::ColourValue color_center_point_
 
Ogre::ColourValue color_end_point_
 
Ogre::ColourValue color_lines_
 
Ogre::ColourValue color_start_point_
 
std::vector< boost::shared_ptr< rviz::Shape > > endPts_
 
Ogre::SceneNode * frame_node_
 
std::vector< boost::shared_ptr< rviz::Line > > lines_
 
float scale_center_point_
 
float scale_end_point_
 
float scale_start_point_
 
Ogre::SceneManager * scene_manager_
 
rviz::Shape::Type shape_center_point_
 
rviz::Shape::Type shape_end_point_
 
rviz::Shape::Type shape_start_point_
 
bool show_acrs_
 
bool show_center_points_
 
bool show_end_points_
 
bool show_lines_
 
bool show_start_points_
 
boost::shared_ptr< Eigen::Spline3d > spline_
 
std::vector< boost::shared_ptr< rviz::Shape > > startPts_
 

Detailed Description

Definition at line 57 of file RouteSegmentsVisual.h.

Constructor & Destructor Documentation

tuw_nav_rviz_plugin::RouteSegmentsVisual::RouteSegmentsVisual ( Ogre::SceneManager *  scene_manager,
Ogre::SceneNode *  parent_node 
)

Definition at line 44 of file RouteSegmentsVisual.cpp.

tuw_nav_rviz_plugin::RouteSegmentsVisual::~RouteSegmentsVisual ( )
virtual

Definition at line 78 of file RouteSegmentsVisual.cpp.

Member Function Documentation

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setArcColor ( Ogre::ColourValue  color)

Definition at line 203 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setCenterPointColor ( Ogre::ColourValue  color)

Definition at line 189 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setCenterPointScale ( float  scale)

Definition at line 265 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setCenterPointShape ( rviz::Shape::Type  shape_type)

Definition at line 237 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setEndPointColor ( Ogre::ColourValue  color)

Definition at line 182 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setEndPointScale ( float  scale)

Definition at line 258 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setEndPointShape ( rviz::Shape::Type  shape_type)

Definition at line 224 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setFrameOrientation ( const Ogre::Quaternion &  orientation)

Definition at line 170 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setFramePosition ( const Ogre::Vector3 position)

Definition at line 165 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setLineColor ( Ogre::ColourValue  color)

Definition at line 197 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setMessage ( const tuw_nav_msgs::RouteSegments::ConstPtr &  msg)

Definition at line 83 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setShowArcs ( bool  visible)

Definition at line 272 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setShowCenterPoints ( bool  visible)

Definition at line 289 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setShowEndPoints ( bool  visible)

Definition at line 285 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setShowLines ( bool  visible)

Definition at line 277 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setShowStartPoints ( bool  visible)

Definition at line 281 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setStartPointColor ( Ogre::ColourValue  color)

Definition at line 175 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setStartPointScale ( float  scale)

Definition at line 251 of file RouteSegmentsVisual.cpp.

void tuw_nav_rviz_plugin::RouteSegmentsVisual::setStartPointShape ( rviz::Shape::Type  shape_type)

Definition at line 211 of file RouteSegmentsVisual.cpp.

Member Data Documentation

std::vector<boost::shared_ptr<rviz::Line> > tuw_nav_rviz_plugin::RouteSegmentsVisual::arcs_
private

Definition at line 110 of file RouteSegmentsVisual.h.

std::vector<boost::shared_ptr<rviz::Shape> > tuw_nav_rviz_plugin::RouteSegmentsVisual::centerPts_
private

Definition at line 108 of file RouteSegmentsVisual.h.

Ogre::ColourValue tuw_nav_rviz_plugin::RouteSegmentsVisual::color_arcs_
private

Definition at line 127 of file RouteSegmentsVisual.h.

Ogre::ColourValue tuw_nav_rviz_plugin::RouteSegmentsVisual::color_center_point_
private

Definition at line 125 of file RouteSegmentsVisual.h.

Ogre::ColourValue tuw_nav_rviz_plugin::RouteSegmentsVisual::color_end_point_
private

Definition at line 124 of file RouteSegmentsVisual.h.

Ogre::ColourValue tuw_nav_rviz_plugin::RouteSegmentsVisual::color_lines_
private

Definition at line 126 of file RouteSegmentsVisual.h.

Ogre::ColourValue tuw_nav_rviz_plugin::RouteSegmentsVisual::color_start_point_
private

Definition at line 123 of file RouteSegmentsVisual.h.

std::vector<boost::shared_ptr<rviz::Shape> > tuw_nav_rviz_plugin::RouteSegmentsVisual::endPts_
private

Definition at line 107 of file RouteSegmentsVisual.h.

Ogre::SceneNode* tuw_nav_rviz_plugin::RouteSegmentsVisual::frame_node_
private

Definition at line 116 of file RouteSegmentsVisual.h.

std::vector<boost::shared_ptr<rviz::Line> > tuw_nav_rviz_plugin::RouteSegmentsVisual::lines_
private

Definition at line 109 of file RouteSegmentsVisual.h.

float tuw_nav_rviz_plugin::RouteSegmentsVisual::scale_center_point_
private

Definition at line 137 of file RouteSegmentsVisual.h.

float tuw_nav_rviz_plugin::RouteSegmentsVisual::scale_end_point_
private

Definition at line 136 of file RouteSegmentsVisual.h.

float tuw_nav_rviz_plugin::RouteSegmentsVisual::scale_start_point_
private

Definition at line 135 of file RouteSegmentsVisual.h.

Ogre::SceneManager* tuw_nav_rviz_plugin::RouteSegmentsVisual::scene_manager_
private

Definition at line 120 of file RouteSegmentsVisual.h.

rviz::Shape::Type tuw_nav_rviz_plugin::RouteSegmentsVisual::shape_center_point_
private

Definition at line 132 of file RouteSegmentsVisual.h.

rviz::Shape::Type tuw_nav_rviz_plugin::RouteSegmentsVisual::shape_end_point_
private

Definition at line 131 of file RouteSegmentsVisual.h.

rviz::Shape::Type tuw_nav_rviz_plugin::RouteSegmentsVisual::shape_start_point_
private

Definition at line 130 of file RouteSegmentsVisual.h.

bool tuw_nav_rviz_plugin::RouteSegmentsVisual::show_acrs_
private

Definition at line 139 of file RouteSegmentsVisual.h.

bool tuw_nav_rviz_plugin::RouteSegmentsVisual::show_center_points_
private

Definition at line 142 of file RouteSegmentsVisual.h.

bool tuw_nav_rviz_plugin::RouteSegmentsVisual::show_end_points_
private

Definition at line 141 of file RouteSegmentsVisual.h.

bool tuw_nav_rviz_plugin::RouteSegmentsVisual::show_lines_
private

Definition at line 138 of file RouteSegmentsVisual.h.

bool tuw_nav_rviz_plugin::RouteSegmentsVisual::show_start_points_
private

Definition at line 140 of file RouteSegmentsVisual.h.

boost::shared_ptr<Eigen::Spline3d> tuw_nav_rviz_plugin::RouteSegmentsVisual::spline_
private

Definition at line 112 of file RouteSegmentsVisual.h.

std::vector<boost::shared_ptr<rviz::Shape> > tuw_nav_rviz_plugin::RouteSegmentsVisual::startPts_
private

Definition at line 106 of file RouteSegmentsVisual.h.


The documentation for this class was generated from the following files:


tuw_nav_rviz_plugin
Author(s):
autogenerated on Sun Aug 28 2016 03:53:55