Public Member Functions | |
void | addBlock (float x, float y, float z, int n) |
void | addBlocks (const actionlib::SimpleClientGoalState &state, const turtlebot_arm_block_manipulation::BlockDetectionResultConstPtr &result) |
BlockManipulationAction () | |
void | detectBlocks () |
void | feedbackCb (const InteractiveMarkerFeedbackConstPtr &feedback) |
Marker | makeBox (InteractiveMarker &msg, float r, float g, float b) |
bool | moveBlock (const geometry_msgs::Pose &start_pose, const geometry_msgs::Pose &end_pose) |
Private Attributes | |
actionlib::SimpleActionClient< turtlebot_arm_block_manipulation::BlockDetectionAction > | block_detection_action_ |
turtlebot_arm_block_manipulation::BlockDetectionGoal | block_detection_goal_ |
ros::NodeHandle | nh_ |
geometry_msgs::Pose | old_pose_ |
actionlib::SimpleActionClient< turtlebot_arm_block_manipulation::PickAndPlaceAction > | pick_and_place_action_ |
turtlebot_arm_block_manipulation::PickAndPlaceGoal | pick_and_place_goal_ |
interactive_markers::InteractiveMarkerServer | server_ |
Definition at line 52 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 70 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 177 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 105 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 97 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 122 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 160 of file block_manipulation_actions.cpp.
|
inline |
Definition at line 141 of file block_manipulation_actions.cpp.
|
private |
Definition at line 60 of file block_manipulation_actions.cpp.
|
private |
Definition at line 63 of file block_manipulation_actions.cpp.
|
private |
Definition at line 57 of file block_manipulation_actions.cpp.
|
private |
Definition at line 66 of file block_manipulation_actions.cpp.
|
private |
Definition at line 61 of file block_manipulation_actions.cpp.
|
private |
Definition at line 64 of file block_manipulation_actions.cpp.
|
private |
Definition at line 55 of file block_manipulation_actions.cpp.