#include <ros/ros.h>#include <ros/topic.h>#include <sensor_msgs/JointState.h>#include <string>#include <laser_assembler/AssembleScans2.h>#include <uos_rotunit_snapshotter/RotunitSnapshotAction.h>#include <actionlib/server/simple_action_server.h>#include <boost/asio.hpp>#include <boost/thread/mutex.hpp>#include <boost/thread/thread.hpp>

Go to the source code of this file.
Classes | |
| class | RotunitSnapshotter |
Defines | |
| #define | MAX_STEP_SIZE M_PI / 8.0 |
Typedefs | |
| typedef actionlib::SimpleActionServer < uos_rotunit_snapshotter::RotunitSnapshotAction > | Server |
| #define MAX_STEP_SIZE M_PI / 8.0 |
Definition at line 43 of file uos_rotunit_snapshotter.h.
| typedef actionlib::SimpleActionServer<uos_rotunit_snapshotter::RotunitSnapshotAction> Server |
Definition at line 45 of file uos_rotunit_snapshotter.h.