#include "sr_standalone/sr_ros_wrapper.hpp"
#include <std_msgs/Float64.h>
#include <pr2_mechanism_msgs/LoadController.h>
#include <pr2_mechanism_msgs/SwitchController.h>
#include <boost/algorithm/string/case_conv.hpp>
#include <algorithm>
Go to the source code of this file.
Namespaces | |
namespace | shadow_robot_standalone |
Variables | |
static const string | shadow_robot_standalone::ctrl_joints [JOINTS_WITH_STATE] |
static const size_t | JOINTS_WITH_STATE = 20 |
const size_t JOINTS_WITH_STATE = 20 [static] |
Definition at line 10 of file sr_ros_wrapper.cpp.