Public Member Functions | |
void | addObject (float x, float y, float z, int n) |
void | addObjects (const actionlib::SimpleClientGoalState &state, const turtlebot_arm_object_manipulation::ObjectDetectionResultConstPtr &result) |
void | detectObjects () |
void | feedbackCb (const InteractiveMarkerFeedbackConstPtr &feedback) |
Marker | makeBox (InteractiveMarker &msg, float r, float g, float b) |
bool | moveObject (const geometry_msgs::Pose &start_pose, const geometry_msgs::Pose &end_pose) |
ObjectManipulationAction () | |
Private Attributes | |
ros::NodeHandle | nh_ |
actionlib::SimpleActionClient< turtlebot_arm_object_manipulation::ObjectDetectionAction > | object_detection_action_ |
turtlebot_arm_object_manipulation::ObjectDetectionGoal | object_detection_goal_ |
geometry_msgs::Pose | old_pose_ |
actionlib::SimpleActionClient< turtlebot_arm_object_manipulation::PickAndPlaceAction > | pick_and_place_action_ |
turtlebot_arm_object_manipulation::PickAndPlaceGoal | pick_and_place_goal_ |
interactive_markers::InteractiveMarkerServer | server_ |
Definition at line 45 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 63 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 161 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 93 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 85 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 108 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 144 of file object_manipulation_actions.cpp.
|
inline |
Definition at line 127 of file object_manipulation_actions.cpp.
|
private |
Definition at line 50 of file object_manipulation_actions.cpp.
|
private |
Definition at line 53 of file object_manipulation_actions.cpp.
|
private |
Definition at line 56 of file object_manipulation_actions.cpp.
|
private |
Definition at line 59 of file object_manipulation_actions.cpp.
|
private |
Definition at line 54 of file object_manipulation_actions.cpp.
|
private |
Definition at line 57 of file object_manipulation_actions.cpp.
|
private |
Definition at line 48 of file object_manipulation_actions.cpp.