active_eef_ | robot_interaction::RobotInteraction | private |
active_generic_ | robot_interaction::RobotInteraction | private |
active_vj_ | robot_interaction::RobotInteraction | private |
addActiveComponent(const InteractiveMarkerConstructorFn &construct, const ProcessFeedbackFn &process, const InteractiveMarkerUpdateFn &update=InteractiveMarkerUpdateFn(), const std::string &name="") | robot_interaction::RobotInteraction | |
addEndEffectorMarkers(const InteractionHandlerPtr &handler, const EndEffectorInteraction &eef, visualization_msgs::InteractiveMarker &im, bool position=true, bool orientation=true) | robot_interaction::RobotInteraction | private |
addEndEffectorMarkers(const InteractionHandlerPtr &handler, const EndEffectorInteraction &eef, const geometry_msgs::Pose &offset, visualization_msgs::InteractiveMarker &im, bool position=true, bool orientation=true) | robot_interaction::RobotInteraction | private |
addInteractiveMarkers(const InteractionHandlerPtr &handler, const double marker_scale=0.0) | robot_interaction::RobotInteraction | |
clear() | robot_interaction::RobotInteraction | |
clearInteractiveMarkers() | robot_interaction::RobotInteraction | |
clearInteractiveMarkersUnsafe() | robot_interaction::RobotInteraction | private |
computeGroupMarkerSize(const std::string &group) | robot_interaction::RobotInteraction | private |
computeLinkMarkerSize(const std::string &link) | robot_interaction::RobotInteraction | private |
computeMarkerPose(const InteractionHandlerPtr &handler, const EndEffectorInteraction &eef, const moveit::core::RobotState &robot_state, geometry_msgs::Pose &pose, geometry_msgs::Pose &control_to_eef_tf) const | robot_interaction::RobotInteraction | private |
decideActiveComponents(const std::string &group) | robot_interaction::RobotInteraction | |
decideActiveComponents(const std::string &group, InteractionStyle::InteractionStyle style) | robot_interaction::RobotInteraction | |
decideActiveEndEffectors(const std::string &group) | robot_interaction::RobotInteraction | private |
decideActiveEndEffectors(const std::string &group, InteractionStyle::InteractionStyle style) | robot_interaction::RobotInteraction | private |
decideActiveJoints(const std::string &group) | robot_interaction::RobotInteraction | private |
feedback_map_ | robot_interaction::RobotInteraction | private |
getActiveEndEffectors() const | robot_interaction::RobotInteraction | inline |
getActiveJoints() const | robot_interaction::RobotInteraction | inline |
getKinematicOptionsMap() | robot_interaction::RobotInteraction | inline |
getRobotModel() const | robot_interaction::RobotInteraction | inline |
getServerTopic() const | robot_interaction::RobotInteraction | inline |
handlers_ | robot_interaction::RobotInteraction | private |
int_marker_move_subscribers_ | robot_interaction::RobotInteraction | private |
int_marker_move_topics_ | robot_interaction::RobotInteraction | private |
int_marker_names_ | robot_interaction::RobotInteraction | private |
int_marker_server_ | robot_interaction::RobotInteraction | private |
INTERACTIVE_MARKER_TOPIC | robot_interaction::RobotInteraction | static |
kinematic_options_map_ | robot_interaction::RobotInteraction | private |
marker_access_lock_ | robot_interaction::RobotInteraction | private |
moveInteractiveMarker(const std::string &name, const geometry_msgs::PoseStamped &msg) | robot_interaction::RobotInteraction | private |
new_feedback_condition_ | robot_interaction::RobotInteraction | private |
processing_thread_ | robot_interaction::RobotInteraction | private |
processingThread() | robot_interaction::RobotInteraction | private |
processInteractiveMarkerFeedback(const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback) | robot_interaction::RobotInteraction | private |
publishInteractiveMarkers() | robot_interaction::RobotInteraction | |
registerMoveInteractiveMarkerTopic(const std::string &marker_name, const std::string &name) | robot_interaction::RobotInteraction | private |
robot_model_ | robot_interaction::RobotInteraction | private |
RobotInteraction(const moveit::core::RobotModelConstPtr &robot_model, const std::string &ns="") | robot_interaction::RobotInteraction | |
run_processing_thread_ | robot_interaction::RobotInteraction | private |
showingMarkers(const InteractionHandlerPtr &handler) | robot_interaction::RobotInteraction | |
shown_markers_ | robot_interaction::RobotInteraction | private |
subscribeMoveInteractiveMarker(const std::string marker_name, const std::string &name) | robot_interaction::RobotInteraction | private |
toggleMoveInteractiveMarkerTopic(bool enable) | robot_interaction::RobotInteraction | |
topic_ | robot_interaction::RobotInteraction | private |
updateInteractiveMarkers(const InteractionHandlerPtr &handler) | robot_interaction::RobotInteraction | |
~RobotInteraction() | robot_interaction::RobotInteraction | virtual |