Classes | Typedefs
datmo.hpp File Reference
#include <ros/ros.h>
#include <math.h>
#include <omp.h>
#include <vector>
#include <random>
#include <algorithm>
#include <chrono>
#include <iostream>
#include <fstream>
#include <sensor_msgs/LaserScan.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <geometry_msgs/Point.h>
#include <tf/tf.h>
#include <datmo/TrackArray.h>
#include <datmo/Track.h>
#include "cluster.hpp"
Include dependency graph for datmo.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  Datmo
 

Typedefs

typedef std::vector< double > l_shape
 
typedef std::vector< l_shapel_shapes
 
typedef std::pair< double, double > Point
 
typedef std::vector< PointpointList
 

Typedef Documentation

◆ l_shape

typedef std::vector<double> l_shape

Definition at line 53 of file datmo.hpp.

◆ l_shapes

typedef std::vector<l_shape> l_shapes

Definition at line 54 of file datmo.hpp.

◆ Point

typedef std::pair<double, double> Point

Definition at line 52 of file datmo.hpp.

◆ pointList

typedef std::vector<Point> pointList

Definition at line 55 of file datmo.hpp.



datmo
Author(s): Kostas Konstantinidis
autogenerated on Tue May 2 2023 02:58:06