Public Member Functions | |
void | createProperties (const Picked &obj, Property *parent_property) |
Override to create properties of the given picked object(s). | |
void | getAABBs (const Picked &obj, V_AABB &aabbs) |
PoseDisplaySelectionHandler (PoseDisplay *display, DisplayContext *context) | |
void | setMessage (const geometry_msgs::PoseStampedConstPtr &message) |
Private Attributes | |
PoseDisplay * | display_ |
StringProperty * | frame_property_ |
QuaternionProperty * | orientation_property_ |
VectorProperty * | position_property_ |
Definition at line 52 of file pose_display.cpp.
rviz::PoseDisplaySelectionHandler::PoseDisplaySelectionHandler | ( | PoseDisplay * | display, |
DisplayContext * | context | ||
) | [inline] |
Definition at line 55 of file pose_display.cpp.
void rviz::PoseDisplaySelectionHandler::createProperties | ( | const Picked & | obj, |
Property * | parent_property | ||
) | [inline, virtual] |
Override to create properties of the given picked object(s).
Top-level properties created here should be added to properties_ so they will be automatically deleted by deleteProperties().
This base implementation does nothing.
Reimplemented from rviz::SelectionHandler.
Definition at line 60 of file pose_display.cpp.
void rviz::PoseDisplaySelectionHandler::getAABBs | ( | const Picked & | obj, |
V_AABB & | aabbs | ||
) | [inline, virtual] |
Reimplemented from rviz::SelectionHandler.
Definition at line 75 of file pose_display.cpp.
void rviz::PoseDisplaySelectionHandler::setMessage | ( | const geometry_msgs::PoseStampedConstPtr & | message | ) | [inline] |
Definition at line 93 of file pose_display.cpp.
Definition at line 113 of file pose_display.cpp.
Definition at line 114 of file pose_display.cpp.
Definition at line 116 of file pose_display.cpp.
Definition at line 115 of file pose_display.cpp.