#include "handle_detector/affordances.h"#include "handle_detector/CylinderArrayMsg.h"#include "handle_detector/CylinderMsg.h"#include "handle_detector/HandleListMsg.h"#include <ctype.h>#include "handle_detector/cylindrical_shell.h"#include "Eigen/Dense"#include "Eigen/Core"#include <iostream>#include "handle_detector/messages.h"#include <pcl_conversions/pcl_conversions.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include <pcl/io/pcd_io.h>#include <ros/ros.h>#include <sensor_msgs/PointCloud2.h>#include <sstream>#include <stdlib.h>#include <stdio.h>#include <string.h>#include <tf/transform_datatypes.h>#include <tf/transform_listener.h>#include <vector>#include "handle_detector/visualizer.h"
Go to the source code of this file.
Defines | |
| #define | EIGEN_DONT_PARALLELIZE |
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ > | PointCloud |
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 |
| tf::StampedTransform | g_transform |
| double | g_update_interval |
| const std::string | RANGE_SENSOR_FRAME = "/kinect_l_rgb_optical_frame" |
| const std::string | RANGE_SENSOR_TOPIC = "/kinect_l/depth_registered/points" |
| #define EIGEN_DONT_PARALLELIZE |
Definition at line 25 of file localization.cpp.
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloud |
Definition at line 27 of file localization.cpp.
| void chatterCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | input | ) |
Definition at line 44 of file localization.cpp.
| PointCloud::Ptr g_cloud | ( | new | PointCloud | ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 101 of file localization.cpp.
Definition at line 34 of file localization.cpp.
| std::vector<CylindricalShell> g_cylindrical_shells |
Definition at line 35 of file localization.cpp.
| std::vector<std::vector<CylindricalShell> > g_handles |
Definition at line 36 of file localization.cpp.
| bool g_has_read = false |
Definition at line 42 of file localization.cpp.
| double g_prev_time |
Definition at line 40 of file localization.cpp.
Definition at line 37 of file localization.cpp.
| double g_update_interval |
Definition at line 41 of file localization.cpp.
| const std::string RANGE_SENSOR_FRAME = "/kinect_l_rgb_optical_frame" |
Definition at line 29 of file localization.cpp.
| const std::string RANGE_SENSOR_TOPIC = "/kinect_l/depth_registered/points" |
Definition at line 30 of file localization.cpp.