#include <ros/ros.h>
#include "std_msgs/String.h"
#include <sensor_msgs/LaserScan.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include "socket.hpp"
#include "parser.hpp"
Go to the source code of this file.
Classes | |
class | AutoLaser |
Macros | |
#define | CONNECT_ATTEMPT_CNT 999 |