#include <geometry_msgs/Twist.h>
#include <tf/transform_broadcaster.h>
#include <nav_msgs/Odometry.h>
#include <std_srvs/Empty.h>
#include <diagnostic_msgs/DiagnosticStatus.h>
#include <diagnostic_msgs/DiagnosticArray.h>
#include <youbot_oodl/PowerBoardState.h>
#include <trajectory_msgs/JointTrajectory.h>
#include <sensor_msgs/JointState.h>
#include <brics_actuator/JointPositions.h>
#include <brics_actuator/JointVelocities.h>
#include <youbot_oodl/YouBotConfiguration.h>
#include <youbot_driver/youbot/JointTrajectoryController.hpp>
#include <youbot_driver/youbot/DataTrace.hpp>
Go to the source code of this file.
Classes | |
class | youBot::YouBotOODLWrapper |
Wrapper class to map ROS messages to OODL method calls for the youBot platform. More... | |
Namespaces | |
namespace | youBot |
Defines | |
#define | mkstr(X) mkstr2(X) |
#define | mkstr2(X) #X |
Definition at line 45 of file YouBotOODLWrapper.h.
#define mkstr2 | ( | X | ) | #X |
Definition at line 44 of file YouBotOODLWrapper.h.