clearError() | robot_interaction::InteractionHandler | |
clearLastEndEffectorMarkerPose(const EndEffectorInteraction &eef) | robot_interaction::InteractionHandler | |
clearLastJointMarkerPose(const JointInteraction &vj) | robot_interaction::InteractionHandler | |
clearLastMarkerPoses() | robot_interaction::InteractionHandler | |
clearMenuHandler() | robot_interaction::InteractionHandler | |
clearPoseOffset(const EndEffectorInteraction &eef) | robot_interaction::InteractionHandler | |
clearPoseOffset(const JointInteraction &vj) | robot_interaction::InteractionHandler | |
clearPoseOffsets() | robot_interaction::InteractionHandler | |
display_controls_ | robot_interaction::InteractionHandler | private |
display_meshes_ | robot_interaction::InteractionHandler | private |
error_state_ | robot_interaction::InteractionHandler | private |
fixName(std::string name) | robot_interaction::InteractionHandler | privatestatic |
getControlsVisible() const | robot_interaction::InteractionHandler | |
getErrorState(const std::string &name) const | robot_interaction::InteractionHandler | private |
getLastEndEffectorMarkerPose(const EndEffectorInteraction &eef, geometry_msgs::PoseStamped &pose) | robot_interaction::InteractionHandler | |
getLastJointMarkerPose(const JointInteraction &vj, geometry_msgs::PoseStamped &pose) | robot_interaction::InteractionHandler | |
getMenuHandler() | robot_interaction::InteractionHandler | |
getMeshesVisible() const | robot_interaction::InteractionHandler | |
getName() const | robot_interaction::InteractionHandler | inline |
getPoseOffset(const EndEffectorInteraction &eef, geometry_msgs::Pose &m) | robot_interaction::InteractionHandler | |
getPoseOffset(const JointInteraction &vj, geometry_msgs::Pose &m) | robot_interaction::InteractionHandler | |
getState() const | robot_interaction::InteractionHandler | |
robot_interaction::LockedRobotState::getState() const | robot_interaction::LockedRobotState | |
getUpdateCallback() const | robot_interaction::InteractionHandler | |
handleEndEffector(const EndEffectorInteraction &eef, const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback) | robot_interaction::InteractionHandler | virtual |
handleGeneric(const GenericInteraction &g, const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback) | robot_interaction::InteractionHandler | virtual |
handleJoint(const JointInteraction &vj, const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback) | robot_interaction::InteractionHandler | virtual |
inError(const EndEffectorInteraction &eef) const | robot_interaction::InteractionHandler | virtual |
inError(const JointInteraction &vj) const | robot_interaction::InteractionHandler | virtual |
inError(const GenericInteraction &g) const | robot_interaction::InteractionHandler | virtual |
InteractionHandler(const RobotInteractionPtr &robot_interaction, const std::string &name, const moveit::core::RobotState &initial_robot_state, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer=std::shared_ptr< tf2_ros::Buffer >()) | robot_interaction::InteractionHandler | |
InteractionHandler(const RobotInteractionPtr &robot_interaction, const std::string &name, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer=std::shared_ptr< tf2_ros::Buffer >()) | robot_interaction::InteractionHandler | |
InteractionHandler(const std::string &name, const moveit::core::RobotState &initial_robot_state, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer=std::shared_ptr< tf2_ros::Buffer >()) | robot_interaction::InteractionHandler | |
InteractionHandler(const std::string &name, const moveit::core::RobotModelConstPtr &model, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer=std::shared_ptr< tf2_ros::Buffer >()) | robot_interaction::InteractionHandler | |
kinematic_options_map_ | robot_interaction::InteractionHandler | private |
LockedRobotState(const moveit::core::RobotState &state) | robot_interaction::LockedRobotState | |
LockedRobotState(const moveit::core::RobotModelPtr &model) | robot_interaction::LockedRobotState | |
menu_handler_ | robot_interaction::InteractionHandler | private |
modifyState(const ModifyStateFunction &modify) | robot_interaction::LockedRobotState | |
ModifyStateFunction typedef | robot_interaction::LockedRobotState | |
name_ | robot_interaction::InteractionHandler | protected |
offset_map_ | robot_interaction::InteractionHandler | private |
offset_map_lock_ | robot_interaction::InteractionHandler | private |
planning_frame_ | robot_interaction::InteractionHandler | protected |
pose_map_ | robot_interaction::InteractionHandler | private |
pose_map_lock_ | robot_interaction::InteractionHandler | private |
robotStateChanged() | robot_interaction::LockedRobotState | protectedvirtual |
setControlsVisible(bool visible) | robot_interaction::InteractionHandler | |
setErrorState(const std::string &name, bool new_error_state) | robot_interaction::InteractionHandler | private |
setMenuHandler(const std::shared_ptr< interactive_markers::MenuHandler > &mh) | robot_interaction::InteractionHandler | |
setMeshesVisible(bool visible) | robot_interaction::InteractionHandler | |
setPoseOffset(const EndEffectorInteraction &eef, const geometry_msgs::Pose &m) | robot_interaction::InteractionHandler | |
setPoseOffset(const JointInteraction &j, const geometry_msgs::Pose &m) | robot_interaction::InteractionHandler | |
setState(const moveit::core::RobotState &state) | robot_interaction::InteractionHandler | |
robot_interaction::LockedRobotState::setState(const moveit::core::RobotState &state) | robot_interaction::LockedRobotState | |
setUpdateCallback(const InteractionHandlerCallbackFn &callback) | robot_interaction::InteractionHandler | |
state_ | robot_interaction::LockedRobotState | private |
state_lock_ | robot_interaction::LockedRobotState | mutableprotected |
StateChangeCallbackFn typedef | robot_interaction::InteractionHandler | private |
tf_buffer_ | robot_interaction::InteractionHandler | protected |
transformFeedbackPose(const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback, const geometry_msgs::Pose &offset, geometry_msgs::PoseStamped &tpose) | robot_interaction::InteractionHandler | protected |
update_callback_ | robot_interaction::InteractionHandler | private |
updateStateEndEffector(moveit::core::RobotState &state, const EndEffectorInteraction &eef, const geometry_msgs::Pose &pose, StateChangeCallbackFn &callback) | robot_interaction::InteractionHandler | private |
updateStateGeneric(moveit::core::RobotState &state, const GenericInteraction &g, const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback, StateChangeCallbackFn &callback) | robot_interaction::InteractionHandler | private |
updateStateJoint(moveit::core::RobotState &state, const JointInteraction &vj, const geometry_msgs::Pose &pose, StateChangeCallbackFn &callback) | robot_interaction::InteractionHandler | private |
~InteractionHandler() override | robot_interaction::InteractionHandler | inline |
~LockedRobotState() | robot_interaction::LockedRobotState | virtual |