#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_ |
Definition at line 57 of file RouteSegmentsVisual.h.
tuw_nav_rviz::RouteSegmentsVisual::RouteSegmentsVisual | ( | Ogre::SceneManager * | scene_manager, |
Ogre::SceneNode * | parent_node | ||
) |
Definition at line 44 of file RouteSegmentsVisual.cpp.
|
virtual |
Definition at line 78 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setArcColor | ( | Ogre::ColourValue | color | ) |
Definition at line 203 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setCenterPointColor | ( | Ogre::ColourValue | color | ) |
Definition at line 189 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setCenterPointScale | ( | float | scale | ) |
Definition at line 265 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setCenterPointShape | ( | rviz::Shape::Type | shape_type | ) |
Definition at line 237 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setEndPointColor | ( | Ogre::ColourValue | color | ) |
Definition at line 182 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setEndPointScale | ( | float | scale | ) |
Definition at line 258 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setEndPointShape | ( | rviz::Shape::Type | shape_type | ) |
Definition at line 224 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setFrameOrientation | ( | const Ogre::Quaternion & | orientation | ) |
Definition at line 170 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setFramePosition | ( | const Ogre::Vector3 & | position | ) |
Definition at line 165 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setLineColor | ( | Ogre::ColourValue | color | ) |
Definition at line 197 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setMessage | ( | const tuw_nav_msgs::RouteSegments::ConstPtr & | msg | ) |
Definition at line 83 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setShowArcs | ( | bool | visible | ) |
Definition at line 272 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setShowCenterPoints | ( | bool | visible | ) |
Definition at line 289 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setShowEndPoints | ( | bool | visible | ) |
Definition at line 285 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setShowLines | ( | bool | visible | ) |
Definition at line 277 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setShowStartPoints | ( | bool | visible | ) |
Definition at line 281 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setStartPointColor | ( | Ogre::ColourValue | color | ) |
Definition at line 175 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setStartPointScale | ( | float | scale | ) |
Definition at line 251 of file RouteSegmentsVisual.cpp.
void tuw_nav_rviz::RouteSegmentsVisual::setStartPointShape | ( | rviz::Shape::Type | shape_type | ) |
Definition at line 211 of file RouteSegmentsVisual.cpp.
|
private |
Definition at line 110 of file RouteSegmentsVisual.h.
|
private |
Definition at line 108 of file RouteSegmentsVisual.h.
|
private |
Definition at line 127 of file RouteSegmentsVisual.h.
|
private |
Definition at line 125 of file RouteSegmentsVisual.h.
|
private |
Definition at line 124 of file RouteSegmentsVisual.h.
|
private |
Definition at line 126 of file RouteSegmentsVisual.h.
|
private |
Definition at line 123 of file RouteSegmentsVisual.h.
|
private |
Definition at line 107 of file RouteSegmentsVisual.h.
|
private |
Definition at line 116 of file RouteSegmentsVisual.h.
|
private |
Definition at line 109 of file RouteSegmentsVisual.h.
|
private |
Definition at line 137 of file RouteSegmentsVisual.h.
|
private |
Definition at line 136 of file RouteSegmentsVisual.h.
|
private |
Definition at line 135 of file RouteSegmentsVisual.h.
|
private |
Definition at line 120 of file RouteSegmentsVisual.h.
|
private |
Definition at line 132 of file RouteSegmentsVisual.h.
|
private |
Definition at line 131 of file RouteSegmentsVisual.h.
|
private |
Definition at line 130 of file RouteSegmentsVisual.h.
|
private |
Definition at line 139 of file RouteSegmentsVisual.h.
|
private |
Definition at line 142 of file RouteSegmentsVisual.h.
|
private |
Definition at line 141 of file RouteSegmentsVisual.h.
|
private |
Definition at line 138 of file RouteSegmentsVisual.h.
|
private |
Definition at line 140 of file RouteSegmentsVisual.h.
|
private |
Definition at line 112 of file RouteSegmentsVisual.h.
|
private |
Definition at line 106 of file RouteSegmentsVisual.h.