#include <string.h>#include <stdarg.h>#include <AR/gsub.h>#include <AR/video.h>#include <AR/param.h>#include <AR/ar.h>#include <AR/arMulti.h>#include <ros/ros.h>#include <ros/package.h>#include <ros/console.h>#include <geometry_msgs/TransformStamped.h>#include <tf/transform_broadcaster.h>#include <visualization_msgs/Marker.h>#include <sensor_msgs/PointCloud2.h>#include <pcl/ros/conversions.h>#include <pcl/point_types.h>#include <pcl/registration/icp.h>#include <pcl/registration/registration.h>#include <pcl/registration/transformation_estimation_svd.h>#include <opencv/cv.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <ar_pose/ARMarkers.h>#include <ar_pose/ARMarker.h>#include <ar_kinect/object.h>

Go to the source code of this file.
Classes | |
| class | ar_pose::ARPublisher | 
Namespaces | |
| namespace | ar_pose | 
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZRGB >  | PointCloud | 
| typedef  pcl::registration::TransformationEstimationSVD < pcl::PointXYZRGB, pcl::PointXYZRGB >  | TransformationEstimationSVD | 
Variables | |
| const double | AR_TO_ROS = 0.001 | 
| const std::string | cloudTopic_ = "points" | 
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloud | 
Definition at line 63 of file ar_kinect.h.
| typedef pcl::registration::TransformationEstimationSVD<pcl::PointXYZRGB, pcl::PointXYZRGB> TransformationEstimationSVD | 
Definition at line 64 of file ar_kinect.h.
| const double AR_TO_ROS = 0.001 | 
Definition at line 62 of file ar_kinect.h.
| const std::string cloudTopic_ = "points" | 
Definition at line 60 of file ar_kinect.h.