computeGripperPose(geometry_msgs::PoseStamped place_location, geometry_msgs::Pose grasp_pose, std::string frame_id) | object_manipulator::PlaceTester | [protected] |
feedback_function_ | object_manipulator::PlaceTester | [protected] |
interrupt_function_ | object_manipulator::PlaceTester | [protected] |
listener_ | object_manipulator::PlaceTester | [protected] |
marker_publisher_ | object_manipulator::PlaceTester | [protected] |
PlaceTester() | object_manipulator::PlaceTester | [inline] |
Result(int result_code, bool continuation) | object_manipulator::PlaceTester | [inline] |
setFeedbackFunction(boost::function< void(size_t)> f) | object_manipulator::PlaceTester | [inline] |
setInterruptFunction(boost::function< bool()> f) | object_manipulator::PlaceTester | [inline] |
setMarkerPublisher(GraspMarkerPublisher *pub) | object_manipulator::PlaceTester | [inline] |
testPlace(const object_manipulation_msgs::PlaceGoal &place_goal, const geometry_msgs::PoseStamped &place_location, PlaceExecutionInfo &execution_info)=0 | object_manipulator::PlaceTester | [protected, pure virtual] |
testPlaces(const object_manipulation_msgs::PlaceGoal &place_goal, const std::vector< geometry_msgs::PoseStamped > &place_locations, std::vector< PlaceExecutionInfo > &execution_info, bool return_on_first_hit) | object_manipulator::PlaceTester | [virtual] |