#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"
Go to the source code of this file.
◆ l_shape
| typedef std::vector<double> l_shape |
◆ l_shapes
◆ Point
| typedef std::pair<double, double> Point |
◆ pointList