#include <ros/ros.h>
#include <ros/callback_queue.h>
#include <image_transport/image_transport.h>
#include <message_filters/subscriber.h>
#include <message_filters/time_synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/Image.h>
#include <tf/tf.h>
#include "feature_tracker/FeatureTracker.h"
#include <boost/thread.hpp>
#include <omip_common/RecursiveEstimatorNodeInterface.h>
#include <dynamic_reconfigure/server.h>
#include <feature_tracker/FeatureTrackerDynReconfConfig.h>
#include <std_msgs/Bool.h>
#include "omip_msgs/ShapeTrackerStates.h"
Go to the source code of this file.
Classes | |
class | omip::BagSubscriber< M > |
class | omip::FeatureTrackerNode |
FeatureTrackerNode class Connects to the ROS communication system to get messages from the sensors and publish results Templated in the state of to be estimated by this RE level (ROS type) The received messages are passed to the FeatureTracker object to be processed. More... | |
Namespaces | |
namespace | omip |