#include <goal_tool.h>
Public Member Functions | |
GoalTool () | |
virtual void | onInitialize () |
virtual | ~GoalTool () |
Protected Member Functions | |
virtual void | onPoseSet (double x, double y, double theta) |
Private Slots | |
void | updateTopic () |
Private Attributes | |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
StringProperty * | topic_property_ |
Definition at line 47 of file goal_tool.h.
Definition at line 42 of file goal_tool.cpp.
virtual rviz::GoalTool::~GoalTool | ( | ) | [inline, virtual] |
Definition at line 52 of file goal_tool.h.
void rviz::GoalTool::onInitialize | ( | ) | [virtual] |
Override onInitialize to do any setup needed after the DisplayContext has been set. This is called by Tool::initialize(). The base implementation here does nothing.
Reimplemented from rviz::PoseTool.
Definition at line 51 of file goal_tool.cpp.
void rviz::GoalTool::onPoseSet | ( | double | x, |
double | y, | ||
double | theta | ||
) | [protected, virtual] |
Implements rviz::PoseTool.
Definition at line 63 of file goal_tool.cpp.
void rviz::GoalTool::updateTopic | ( | ) | [private, slot] |
Definition at line 58 of file goal_tool.cpp.
ros::NodeHandle rviz::GoalTool::nh_ [private] |
Definition at line 62 of file goal_tool.h.
ros::Publisher rviz::GoalTool::pub_ [private] |
Definition at line 63 of file goal_tool.h.
StringProperty* rviz::GoalTool::topic_property_ [private] |
Definition at line 65 of file goal_tool.h.