#include <ros/ros.h>
#include <tf_conversions/tf_eigen.h>
#include <geometry_msgs/PoseArray.h>
#include <moveit_msgs/Grasp.h>
#include <moveit/macros/deprecation.h>
#include <Eigen/Core>
#include <Eigen/Geometry>
#include <eigen_conversions/eigen_msg.h>
#include <moveit_visual_tools/moveit_visual_tools.h>
#include <math.h>
#include <moveit_simple_grasps/grasp_data.h>
Go to the source code of this file.
Classes | |
class | moveit_simple_grasps::SimpleGrasps |
Namespaces | |
namespace | moveit_simple_grasps |
Simple pick place for blocks. | |
Defines | |
#define | _USE_MATH_DEFINES |
Typedefs | |
typedef boost::shared_ptr < const SimpleGrasps > | moveit_simple_grasps::SimpleGraspsConstPtr |
typedef boost::shared_ptr < SimpleGrasps > | moveit_simple_grasps::SimpleGraspsPtr |
Enumerations | |
enum | moveit_simple_grasps::grasp_axis_t { moveit_simple_grasps::X_AXIS, moveit_simple_grasps::Y_AXIS, moveit_simple_grasps::Z_AXIS } |
enum | moveit_simple_grasps::grasp_direction_t { moveit_simple_grasps::UP, moveit_simple_grasps::DOWN } |
enum | moveit_simple_grasps::grasp_rotation_t { moveit_simple_grasps::FULL, moveit_simple_grasps::HALF } |
Variables | |
static const double | moveit_simple_grasps::RAD2DEG = 57.2957795 |
#define _USE_MATH_DEFINES |
Definition at line 64 of file simple_grasps.h.