The tracking class is responsive to track consecutive image frames (presentation). More...
#include <ros/ros.h>
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/Range.h>
#include <message_filters/subscriber.h>
#include <message_filters/time_synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <image_transport/subscriber_filter.h>
#include <image_geometry/stereo_camera_model.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <tf/transform_broadcaster.h>
#include <pcl_ros/point_cloud.h>
#include <pcl_ros/transforms.h>
#include <pcl/point_types.h>
#include <pcl/common/common.h>
#include <pcl/filters/filter.h>
#include <pcl/filters/approximate_voxel_grid.h>
#include <pcl/filters/crop_box.h>
#include <opencv2/opencv.hpp>
#include <boost/filesystem.hpp>
#include <boost/lexical_cast.hpp>
#include "frame.h"
#include "graph.h"
#include "publisher.h"
Go to the source code of this file.
Classes | |
struct | slam::Tracking::Params |
class | slam::Tracking |
Namespaces | |
namespace | slam |
Typedefs | |
typedef pcl::PointCloud< PointRGB > | PointCloudRGB |
typedef pcl::PointCloud< PointXYZ > | PointCloudXYZ |
typedef pcl::PointXYZRGB | PointRGB |
typedef pcl::PointXYZ | PointXYZ |
The tracking class is responsive to track consecutive image frames (presentation).
Definition in file tracking.h.
typedef pcl::PointCloud<PointRGB> PointCloudRGB |
Definition at line 46 of file tracking.h.
typedef pcl::PointCloud<PointXYZ> PointCloudXYZ |
Definition at line 45 of file tracking.h.
typedef pcl::PointXYZRGB PointRGB |
Definition at line 44 of file tracking.h.
typedef pcl::PointXYZ PointXYZ |
Definition at line 43 of file tracking.h.