Skip to content
Snippets Groups Projects

add homeing method

Merged Johannes Mey requested to merge noetic/feature/homing into master
2 files
+ 27
0
Compare changes
  • Side-by-side
  • Inline
Files
2
+ 7
0
@@ -90,6 +90,13 @@ public:
@@ -90,6 +90,13 @@ public:
bool placeFromAbove(moveit::planning_interface::MoveGroupInterface &move_group, geometry_msgs::Pose &place_pose,
bool placeFromAbove(moveit::planning_interface::MoveGroupInterface &move_group, geometry_msgs::Pose &place_pose,
double open_amount, std::string supporting_surface_id, std::string object_to_place_id, bool plan_only = false);
double open_amount, std::string supporting_surface_id, std::string object_to_place_id, bool plan_only = false);
 
/**
 
* Homes the gripper (in case it was abused before and is in an inconsistent state)
 
* This method is blocking with a maximum runtime of ~30s
 
* @return true if homing succeeded, false otherwise
 
*/
 
static bool homeGripper();
 
};
};
#endif //PANDA_GRASPING_GRASP_UTIL_H
#endif //PANDA_GRASPING_GRASP_UTIL_H
Loading