#include <algorithm>
#include <cmath>
#include <utility>
#include <boost/smart_ptr.hpp>
#include <boost/range/iterator_range_core.hpp>
#include <boost/accumulators/accumulators.hpp>
#include <boost/accumulators/statistics/density.hpp>
#include <boost/accumulators/statistics/stats.hpp>
#include <angles/angles.h>
#include <geometry_msgs/Twist.h>
#include <image_transport/image_transport.h>
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <tf/tf.h>
#include <nav_msgs/Odometry.h>
#include <lama_jockeys/navigating_jockey.h>
#include <featurenav_base/typedef.h>
#include <featurenav_base/GetSegment.h>
#include <featurenav_base/Landmark.h>
Go to the source code of this file.
Classes | |
class | featurenav_base::NJockey |
Namespaces | |
namespace | featurenav_base |
Typedefs | |
typedef boost::accumulators::accumulator_set < double, boost::accumulators::stats < density > > | featurenav_base::accumulator_type |
typedef boost::iterator_range < vector< std::pair< double, double > >::iterator > | featurenav_base::histogram_type |