#include "handle_detector/affordances.h"#include <boost/random/normal_distribution.hpp>#include <boost/thread/thread.hpp>#include <ctype.h>#include "handle_detector/cylindrical_shell.h"#include "Eigen/Dense"#include "Eigen/Core"#include "handle_detector/CylinderArrayMsg.h"#include "handle_detector/CylinderMsg.h"#include "handle_detector/HandleListMsg.h"#include "handle_detector/messages.h"#include "handle_detector/sampling.h"#include "handle_detector/visualizer.h"#include <iostream>#include <pcl_conversions/pcl_conversions.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include <pcl/io/pcd_io.h>#include <pcl/visualization/pcl_visualizer.h>#include <ros/ros.h>#include <sensor_msgs/PointCloud2.h>#include <sstream>#include <stdlib.h>#include <stdio.h>#include <string.h>#include <vector>
Go to the source code of this file.
Defines | |
| #define | EIGEN_DONT_PARALLELIZE |
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ > | PointCloud |
| typedef pcl::PointCloud < pcl::PointXYZRGB > | PointCloudRGB |
Functions | |
| void | chatterCallback (const sensor_msgs::PointCloud2ConstPtr &input) |
| PointCloud::Ptr | g_cloud (new PointCloud) |
| int | main (int argc, char **argv) |
Variables | |
| Affordances | g_affordances |
| std::vector< CylindricalShell > | g_cylindrical_shells |
| std::vector< std::vector < CylindricalShell > > | g_handles |
| bool | g_has_read = false |
| double | g_prev_time |
| Sampling | g_sampling |
| double | g_update_interval |
| const std::string | RANGE_SENSOR_FRAME = "/camera_rgb_optical_frame" |
| const std::string | RANGE_SENSOR_TOPIC = "/camera/depth_registered/points" |
| #define EIGEN_DONT_PARALLELIZE |
Definition at line 27 of file importance_sampling.cpp.
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloud |
Definition at line 29 of file importance_sampling.cpp.
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloudRGB |
Definition at line 30 of file importance_sampling.cpp.
| void chatterCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | input | ) |
Definition at line 48 of file importance_sampling.cpp.
| PointCloud::Ptr g_cloud | ( | new | PointCloud | ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 96 of file importance_sampling.cpp.
Definition at line 38 of file importance_sampling.cpp.
| std::vector<CylindricalShell> g_cylindrical_shells |
Definition at line 40 of file importance_sampling.cpp.
| std::vector<std::vector<CylindricalShell> > g_handles |
Definition at line 41 of file importance_sampling.cpp.
| bool g_has_read = false |
Definition at line 46 of file importance_sampling.cpp.
| double g_prev_time |
Definition at line 44 of file importance_sampling.cpp.
Definition at line 39 of file importance_sampling.cpp.
| double g_update_interval |
Definition at line 45 of file importance_sampling.cpp.
| const std::string RANGE_SENSOR_FRAME = "/camera_rgb_optical_frame" |
Definition at line 32 of file importance_sampling.cpp.
| const std::string RANGE_SENSOR_TOPIC = "/camera/depth_registered/points" |
Definition at line 33 of file importance_sampling.cpp.