Classes | |
| class | RosGraspitInterface |
| Main class, combining a ROS node with a GraspIt! interface. More... | |
Functions | |
| bool | biggerThanSbVec3f (const SbVec3f &b1, const SbVec3f &b2) |
| void | getSbBoxDimension (SbBox3f &bbx, vec3 &dimension) |
| transf | poseStampedToTransf (const geometry_msgs::PoseStamped &pose) |
| transf | poseToTransf (const geometry_msgs::Pose &pose) |
| void | randomPoseGenerate (SbBox3f &bb_space, geometry_msgs::Pose &grasp_random_pose) |
| double | randomUniformReal (double min, double max) |
| bool | smallerThanSbVec3f (const SbVec3f &b1, const SbVec3f &b2) |
| geometry_msgs::Pose | transfToPose (const transf &tr) |
| bool graspit_ros_planning::biggerThanSbVec3f | ( | const SbVec3f & | b1, |
| const SbVec3f & | b2 | ||
| ) | [inline] |
Definition at line 127 of file ros_graspit_interface.cpp.
| void graspit_ros_planning::getSbBoxDimension | ( | SbBox3f & | bbx, |
| vec3 & | dimension | ||
| ) | [inline] |
Definition at line 106 of file ros_graspit_interface.cpp.
| transf graspit_ros_planning::poseStampedToTransf | ( | const geometry_msgs::PoseStamped & | pose | ) |
Definition at line 94 of file ros_graspit_interface.cpp.
| transf graspit_ros_planning::poseToTransf | ( | const geometry_msgs::Pose & | pose | ) |
Definition at line 88 of file ros_graspit_interface.cpp.
| void graspit_ros_planning::randomPoseGenerate | ( | SbBox3f & | bb_space, |
| geometry_msgs::Pose & | grasp_random_pose | ||
| ) |
Definition at line 144 of file ros_graspit_interface.cpp.
| double graspit_ros_planning::randomUniformReal | ( | double | min, |
| double | max | ||
| ) | [inline] |
Definition at line 139 of file ros_graspit_interface.cpp.
| bool graspit_ros_planning::smallerThanSbVec3f | ( | const SbVec3f & | b1, |
| const SbVec3f & | b2 | ||
| ) | [inline] |
Definition at line 115 of file ros_graspit_interface.cpp.
| geometry_msgs::Pose graspit_ros_planning::transfToPose | ( | const transf & | tr | ) |
Definition at line 100 of file ros_graspit_interface.cpp.