moveit_simple_grasps

Summary

moveit_simple_grasps
Version:

1.3.1

Description:

A basic grasp generator for simple objects such as blocks or cylinders for use with the MoveIt! pick and place pipeline. Does not consider friction cones or other dynamics.

Maintainers:
  • Dave Coleman <davetcoleman AT gmail DOT com>
Licenses:
  • BSD
Urls:
Authors:
  • Dave Coleman <davetcoleman AT gmail DOT com>
BuildDepends:
BuildtoolDepends:
 
BuildExportDepends:
 
ExecDepends:

Types

Message types

moveit_simple_grasps/GraspGeneratorOptions
Field:
  • grasp_axis (uint8) –
  • grasp_direction (uint8) –
  • grasp_rotation (uint8) –
Constant:
  • GRASP_AXIS_X (uint8):0
  • GRASP_AXIS_Y (uint8):1
  • GRASP_AXIS_Z (uint8):2
  • GRASP_DIRECTION_UP (uint8):0
  • GRASP_DIRECTION_DOWN (uint8):1
  • GRASP_ROTATION_HALF (uint8):0
  • GRASP_ROTATION_FULL (uint8):1
uint8 grasp_axis
uint8 GRASP_AXIS_X = 0
uint8 GRASP_AXIS_Y = 1
uint8 GRASP_AXIS_Z = 2

uint8 grasp_direction
uint8 GRASP_DIRECTION_UP = 0
uint8 GRASP_DIRECTION_DOWN = 1

uint8 grasp_rotation
uint8 GRASP_ROTATION_HALF = 0
uint8 GRASP_ROTATION_FULL = 1

Action types

moveit_simple_grasps/GenerateGrasps
Field (Goal):
Field (Result):
Field (Feedback):
 

goal

#goal
geometry_msgs/Pose pose
float64 width
moveit_simple_grasps/GraspGeneratorOptions[] options
---
#result
moveit_msgs/Grasp[] grasps
---
#feedback
moveit_msgs/Grasp[] grasps