#include "ros/ros.h"
#include "sensor_msgs/Range.h"
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/publisher.h>
#include <dynamic_reconfigure/server.h>
#include <evarobot_infrared/ParamsConfig.h>
#include <vector>
#include <sstream>
#include <boost/shared_ptr.hpp>
#include "IMADC.h"
#include <ros/console.h>
#include "ErrorCodes.h"
Go to the source code of this file.
Classes | |
class | IMDynamicReconfig |
class | IMInfrared |
Defines | |
#define | MAX_IR 8 |
#define MAX_IR 8 |
Definition at line 27 of file evarobot_infrared.h.