Go to the documentation of this file.00001 #ifndef __YUMI_TEST_CONTROLLERS_H
00002 #define __YUMI_TEST_CONTROLLERS_H
00003
00004
00005 #include <cstdlib>
00006 #include <chrono>
00007 #include <iostream>
00008 #include <signal.h>
00009
00010
00011 #include <boost/thread/mutex.hpp>
00012 #include <boost/thread.hpp>
00013
00014 #include <ros/ros.h>
00015 #include <ros/console.h>
00016 #include <sensor_msgs/JointState.h>
00017 #include <std_msgs/Float64.h>
00018 #include <std_msgs/Float64MultiArray.h>
00019 #include <trajectory_msgs/JointTrajectory.h>
00020
00021 using namespace std;
00022
00023
00024
00025
00026 #endif