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 ::robot_interaction::InteractionHandlerPtr &handler, const EndEffectorInteraction &eef, visualization_msgs::InteractiveMarker &im, bool position=true, bool orientation=true) | robot_interaction::RobotInteraction | private |
addEndEffectorMarkers(const ::robot_interaction::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 ::robot_interaction::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 ::robot_interaction::InteractionHandlerPtr &handler, const EndEffectorInteraction &eef, const robot_state::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 | |
decideActiveComponents(const std::string &group, EndEffectorInteractionStyle 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 |
decideActiveEndEffectors(const std::string &group, EndEffectorInteractionStyle style) | robot_interaction::RobotInteraction | |
decideActiveJoints(const std::string &group) | robot_interaction::RobotInteraction | private |
EEF_6DOF enum value | robot_interaction::RobotInteraction | |
EEF_6DOF_NOSPHERE enum value | robot_interaction::RobotInteraction | |
EEF_6DOF_SPHERE enum value | robot_interaction::RobotInteraction | |
EEF_FIXED enum value | robot_interaction::RobotInteraction | |
EEF_ORIENTATION enum value | robot_interaction::RobotInteraction | |
EEF_ORIENTATION_CIRCLES enum value | robot_interaction::RobotInteraction | |
EEF_ORIENTATION_EEF enum value | robot_interaction::RobotInteraction | |
EEF_ORIENTATION_NOSPHERE enum value | robot_interaction::RobotInteraction | |
EEF_ORIENTATION_SPHERE enum value | robot_interaction::RobotInteraction | |
EEF_POSITION enum value | robot_interaction::RobotInteraction | |
EEF_POSITION_ARROWS enum value | robot_interaction::RobotInteraction | |
EEF_POSITION_EEF enum value | robot_interaction::RobotInteraction | |
EEF_POSITION_NOSPHERE enum value | robot_interaction::RobotInteraction | |
EEF_POSITION_SPHERE enum value | robot_interaction::RobotInteraction | |
EndEffector typedef | robot_interaction::RobotInteraction | |
EndEffectorInteractionStyle enum name | robot_interaction::RobotInteraction | |
feedback_map_ | robot_interaction::RobotInteraction | private |
Generic typedef | robot_interaction::RobotInteraction | |
getActiveEndEffectors() const | robot_interaction::RobotInteraction | inline |
getActiveJoints() const | robot_interaction::RobotInteraction | inline |
getKinematicOptionsMap() | robot_interaction::RobotInteraction | inline |
getRobotModel() const | robot_interaction::RobotInteraction | inline |
getServerTopic(void) 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 |
InteractionHandler typedef | robot_interaction::RobotInteraction | |
InteractionHandlerPtr typedef | robot_interaction::RobotInteraction | |
INTERACTIVE_MARKER_TOPIC | robot_interaction::RobotInteraction | static |
Joint typedef | robot_interaction::RobotInteraction | |
kinematic_options_map_ | robot_interaction::RobotInteraction | private |
marker_access_lock_ | robot_interaction::RobotInteraction | private |
moveInteractiveMarker(const std::string name, const geometry_msgs::PoseStampedConstPtr &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 robot_model::RobotModelConstPtr &kmodel, const std::string &ns="") | robot_interaction::RobotInteraction | |
run_processing_thread_ | robot_interaction::RobotInteraction | private |
showingMarkers(const ::robot_interaction::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 ::robot_interaction::InteractionHandlerPtr &handler) | robot_interaction::RobotInteraction | |
updateState(robot_state::RobotState &state, const EndEffectorInteraction &eef, const geometry_msgs::Pose &pose, unsigned int attempts, double ik_timeout, const robot_state::GroupStateValidityCallbackFn &validity_callback=robot_state::GroupStateValidityCallbackFn(), const kinematics::KinematicsQueryOptions &kinematics_query_options=kinematics::KinematicsQueryOptions()) | robot_interaction::RobotInteraction | static |
~RobotInteraction() | robot_interaction::RobotInteraction | virtual |