#include <ros/ros.h>#include <geometry_msgs/PoseArray.h>#include <Eigen/Core>#include <Eigen/Geometry>#include <moveit_simple_grasps/simple_grasps.h>#include <moveit_simple_grasps/custom_environment2.h>
Go to the source code of this file.
Classes | |
| class | baxter_pick_place::GraspGeneratorTest |
Namespaces | |
| namespace | baxter_pick_place |
Functions | |
| int | main (int argc, char *argv[]) |
Variables | |
| static const double | baxter_pick_place::BLOCK_SIZE = 0.04 |
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 214 of file simple_grasps_test.cpp.