#include <ros/ros.h>#include <tf/transform_listener.h>#include <tf/transform_broadcaster.h>#include "tf/message_filter.h"#include "message_filters/subscriber.h"#include <pcl/point_types.h>#include <pcl_ros/point_cloud.h>#include <Eigen/Core>#include <std_srvs/Empty.h>#include <door_perception_msgs/DoorState.h>#include <door_perception_msgs/DoorStateSrv.h>

Go to the source code of this file.
Classes | |
| class | DoorHandleDetector |
| This class detects the door handle in 3D point clouds. More... | |
Typedefs | |
| typedef pcl::PointCloud < PointType > | PointCloudType |
| typedef pcl::PointXYZ | PointType |
Functions | |
| bool | computeMainAxis (const PointCloudType &pc, Eigen::Vector3f &mean, Eigen::Vector3f &main_axis, float eval_ratio_threshold) |
| typedef pcl::PointCloud<PointType> PointCloudType |
Definition at line 18 of file handle_detector.h.
| typedef pcl::PointXYZ PointType |
Definition at line 17 of file handle_detector.h.
| bool computeMainAxis | ( | const PointCloudType & | pc, |
| Eigen::Vector3f & | mean, | ||
| Eigen::Vector3f & | main_axis, | ||
| float | eval_ratio_threshold | ||
| ) |
Definition at line 310 of file handle_detector.cpp.