Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
Variables | |
const std::string | CLOUD_FRAME = "camera_rgb_optical_frame" |
const std::string | CLOUD_TOPIC = "input_cloud" |
const int | CLOUD_TYPE = 0 |
const std::string | CLOUD_TYPES [2] = {"sensor_msgs/PointCloud2", "grasp_affordances/CloudSized"} |
const double | FINGER_WIDTH = 0.01 |
const double | HAND_DEPTH = 0.06 |
const double | HAND_HEIGHT = 0.02 |
const double | HAND_OUTER_DIAMETER = 0.09 |
const double | INIT_BITE = 0.01 |
const int | MIN_HANDLE_INLIERS = 3 |
const int | NUM_CLOUDS = 2 |
const int | NUM_SAMPLES = 1000 |
const int | NUM_THREADS = 1 |
const std::string | SVM_FILE_NAME = "/home/baxter/svm" |
const double | WORKSPACE [6] = {0.65, 0.9, -0.2, 0.07, -0.3, 1.0} |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 24 of file find_grasps.cpp.
const std::string CLOUD_FRAME = "camera_rgb_optical_frame" |
Definition at line 8 of file find_grasps.cpp.
const std::string CLOUD_TOPIC = "input_cloud" |
Definition at line 7 of file find_grasps.cpp.
const int CLOUD_TYPE = 0 |
Definition at line 20 of file find_grasps.cpp.
const std::string CLOUD_TYPES[2] = {"sensor_msgs/PointCloud2", "grasp_affordances/CloudSized"} |
Definition at line 21 of file find_grasps.cpp.
const double FINGER_WIDTH = 0.01 |
Definition at line 13 of file find_grasps.cpp.
const double HAND_DEPTH = 0.06 |
Definition at line 15 of file find_grasps.cpp.
const double HAND_HEIGHT = 0.02 |
Definition at line 17 of file find_grasps.cpp.
const double HAND_OUTER_DIAMETER = 0.09 |
Definition at line 14 of file find_grasps.cpp.
const double INIT_BITE = 0.01 |
Definition at line 16 of file find_grasps.cpp.
const int MIN_HANDLE_INLIERS = 3 |
Definition at line 19 of file find_grasps.cpp.
const int NUM_CLOUDS = 2 |
Definition at line 12 of file find_grasps.cpp.
const int NUM_SAMPLES = 1000 |
Definition at line 11 of file find_grasps.cpp.
const int NUM_THREADS = 1 |
Definition at line 10 of file find_grasps.cpp.
const std::string SVM_FILE_NAME = "/home/baxter/svm" |
Definition at line 9 of file find_grasps.cpp.
const double WORKSPACE[6] = {0.65, 0.9, -0.2, 0.07, -0.3, 1.0} |
Definition at line 18 of file find_grasps.cpp.