#include "play_motion/controller_updater.h"
#include <boost/foreach.hpp>
#include <controller_manager_msgs/ListControllers.h>
Go to the source code of this file.
Namespaces | |
namespace | play_motion |
Defines | |
#define | foreach BOOST_FOREACH |
Functions | |
static ros::ServiceClient | play_motion::initCmClient (ros::NodeHandle nh) |
static bool | play_motion::isJointTrajectoryController (const std::string &name) |
#define foreach BOOST_FOREACH |
Definition at line 42 of file controller_updater.cpp.