#include <boost/thread/thread.hpp>#include <boost/thread/mutex.hpp>#include <boost/thread/condition.hpp>#include <ros/ros.h>#include <tf/transform_listener.h>#include <sensor_msgs/PointCloud.h>#include <mapping_msgs/PolygonalMap.h>#include <body_msgs/Hands.h>#include <sensor_msgs/point_cloud_conversion.h>#include <pcl_tools/pcl_utils.h>#include <nnn/nnn.hpp>#include <pcl_tools/segfast.hpp>#include "pcl/io/pcd_io.h"#include "pcl/point_types.h"#include <pcl/ModelCoefficients.h>#include <pcl/features/normal_3d.h>#include <pcl/filters/extract_indices.h>#include <pcl/filters/passthrough.h>#include <pcl/sample_consensus/method_types.h>#include <pcl/sample_consensus/model_types.h>#include <pcl/segmentation/sac_segmentation.h>
Go to the source code of this file.
Classes | |
| class | HandDetector |
| HandDetector is the main ROS communication class, and its function is just to tye things together. More... | |
| class | TimeEvaluator |
Functions | |
| geometry_msgs::Point | eigenToMsgPoint (Eigen::Vector4f v) |
| geometry_msgs::Point32 | eigenToMsgPoint32 (Eigen::Vector4f v) |
| pcl::PointXYZ | eigenToPclPoint (Eigen::Vector4f v) |
| bool | findNearbyPts (pcl::PointCloud< pcl::PointXYZ > &cloud, std::vector< int > &cloudpts, Eigen::Vector4f ¢roid) |
| void | flipvec (Eigen::Vector4f palm, Eigen::Vector4f fcentroid, Eigen::Vector4f &dir) |
| float | gdist (pcl::PointXYZ pt, Eigen::Vector4f v) |
| bool | getNearBlobs2 (pcl::PointCloud< pcl::PointXYZ > &cloud, std::vector< pcl::PointCloud< pcl::PointXYZ > > &clouds, std::vector< Eigen::Vector4f > &nearcents) |
| int | main (int argc, char **argv) |
| geometry_msgs::Point eigenToMsgPoint | ( | Eigen::Vector4f | v | ) |
Definition at line 129 of file detect_hands.cpp.
| geometry_msgs::Point32 eigenToMsgPoint32 | ( | Eigen::Vector4f | v | ) |
Definition at line 124 of file detect_hands.cpp.
| pcl::PointXYZ eigenToPclPoint | ( | Eigen::Vector4f | v | ) |
Definition at line 135 of file detect_hands.cpp.
| bool findNearbyPts | ( | pcl::PointCloud< pcl::PointXYZ > & | cloud, |
| std::vector< int > & | cloudpts, | ||
| Eigen::Vector4f & | centroid | ||
| ) |
Definition at line 146 of file detect_hands.cpp.
| void flipvec | ( | Eigen::Vector4f | palm, |
| Eigen::Vector4f | fcentroid, | ||
| Eigen::Vector4f & | dir | ||
| ) |
Definition at line 118 of file detect_hands.cpp.
| float gdist | ( | pcl::PointXYZ | pt, |
| Eigen::Vector4f | v | ||
| ) |
Definition at line 114 of file detect_hands.cpp.
| bool getNearBlobs2 | ( | pcl::PointCloud< pcl::PointXYZ > & | cloud, |
| std::vector< pcl::PointCloud< pcl::PointXYZ > > & | clouds, | ||
| std::vector< Eigen::Vector4f > & | nearcents | ||
| ) |
Definition at line 179 of file detect_hands.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 419 of file detect_hands.cpp.