Public Types | |
enum | MoveArmState { RARM, LARM, ARMS } |
enum | MoveOriginState { HAND_ORIGIN, DESIGNATED_ORIGIN } |
Public Member Functions | |
ControlState () | |
void | print () |
Public Attributes | |
bool | base_on_ |
GripperState | dual_grippers_ |
bool | head_on_ |
bool | init_head_goal_ |
bool | l_finger_on_ |
GripperState | l_gripper_ |
bool | look_auto_on_ |
geometry_msgs::PoseStamped | marker_pose_ |
MoveArmState | move_arm_ |
MoveOriginState | move_origin_state_ |
bool | planar_only_ |
bool | posture_l_ |
bool | posture_r_ |
bool | projector_on_ |
bool | r_finger_on_ |
GripperState | r_gripper_ |
bool | torso_on_ |
Definition at line 235 of file interactive_marker_interface.h.
Enumerator | |
---|---|
RARM | |
LARM | |
ARMS |
Definition at line 247 of file interactive_marker_interface.h.
Enumerator | |
---|---|
HAND_ORIGIN | |
DESIGNATED_ORIGIN |
Definition at line 248 of file interactive_marker_interface.h.
|
inline |
Definition at line 236 of file interactive_marker_interface.h.
|
inline |
Definition at line 239 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::base_on_ |
Definition at line 262 of file interactive_marker_interface.h.
GripperState InteractiveMarkerInterface::ControlState::dual_grippers_ |
Definition at line 266 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::head_on_ |
Definition at line 258 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::init_head_goal_ |
Definition at line 261 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::l_finger_on_ |
Definition at line 265 of file interactive_marker_interface.h.
GripperState InteractiveMarkerInterface::ControlState::l_gripper_ |
Definition at line 268 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::look_auto_on_ |
Definition at line 260 of file interactive_marker_interface.h.
geometry_msgs::PoseStamped InteractiveMarkerInterface::ControlState::marker_pose_ |
Definition at line 253 of file interactive_marker_interface.h.
MoveArmState InteractiveMarkerInterface::ControlState::move_arm_ |
Definition at line 250 of file interactive_marker_interface.h.
MoveOriginState InteractiveMarkerInterface::ControlState::move_origin_state_ |
Definition at line 251 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::planar_only_ |
Definition at line 263 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::posture_l_ |
Definition at line 256 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::posture_r_ |
Definition at line 255 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::projector_on_ |
Definition at line 259 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::r_finger_on_ |
Definition at line 264 of file interactive_marker_interface.h.
GripperState InteractiveMarkerInterface::ControlState::r_gripper_ |
Definition at line 267 of file interactive_marker_interface.h.
bool InteractiveMarkerInterface::ControlState::torso_on_ |
Definition at line 257 of file interactive_marker_interface.h.