#include <stdlib.h>#include <string>#include <math.h>#include <algorithm>#include <iostream>#include <vector>#include "head_pose_estimation/CRForestEstimator.h"#include <ros/ros.h>#include "sensor_msgs/Image.h"#include "sensor_msgs/PointCloud2.h"#include "image_transport/image_transport.h"#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include <kdl/frames.hpp>#include <angles/angles.h>#include <geometry_msgs/PoseStamped.h>#include <geometry_msgs/PointStamped.h>#include <tf/transform_listener.h>#include <tf/transform_broadcaster.h>#include "people_msgs/PositionMeasurement.h"#include "people_msgs/PositionMeasurementArray.h"
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ > | PointCloud |
Functions | |
| void | cloudCallback (const sensor_msgs::PointCloud2ConstPtr &msg) |
| void | loadConfig () |
| int | main (int argc, char *argv[]) |
| void | peopleCallback (const people_msgs::PositionMeasurementArray::ConstPtr &msg) |
Variables | |
| tf::TransformBroadcaster * | broadcaster |
| CRForestEstimator | estimator |
| string | g_cloud_frame |
| bool | g_cloud_ready = false |
| std::vector< std::vector< Vote > > | g_clusters |
| CRForestEstimator * | g_Estimate |
| double | g_head_depth = 0.5 |
| bool | g_head_depth_ready = false |
| string | g_head_target_frame |
| Mat | g_im3D |
| double | g_larger_radius_ratio = 1.f |
| int | g_max_z = 0 |
| double | g_maxv = 800.f |
| std::vector< cv::Vec< float, POSE_SIZE > > | g_means |
| int | g_ntrees |
| int | g_p_height |
| int | g_p_width |
| double | g_pitch_bias = 0 |
| float | g_prob_th = 1.0f |
| double | g_roll_bias = 0 |
| double | g_smaller_radius_ratio = 6.f |
| int | g_stride = 5 |
| int | g_th = 400 |
| tf::StampedTransform | g_transform |
| bool | g_transform_ready = false |
| string | g_treepath |
| std::vector< Vote > | g_votes |
| double | g_yaw_bias = 0 |
| tf::TransformListener * | listener |
| ros::Publisher | pose_pub |
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloud |
| void cloudCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | msg | ) |
| void loadConfig | ( | ) |
| void peopleCallback | ( | const people_msgs::PositionMeasurementArray::ConstPtr & | msg | ) |
| string g_cloud_frame |
| bool g_cloud_ready = false |
| std::vector< std::vector< Vote > > g_clusters |
| double g_head_depth = 0.5 |
| bool g_head_depth_ready = false |
| string g_head_target_frame |
| double g_larger_radius_ratio = 1.f |
| int g_p_height |
| double g_pitch_bias = 0 |
| double g_roll_bias = 0 |
| double g_smaller_radius_ratio = 6.f |
| bool g_transform_ready = false |
| string g_treepath |
| double g_yaw_bias = 0 |