#include "moveit_fake_controllers.h"#include <ros/ros.h>#include <moveit/robot_state/robot_state.h>#include <moveit/robot_model_loader/robot_model_loader.h>#include <sensor_msgs/JointState.h>#include <pluginlib/class_list_macros.h>#include <map>#include <iterator>
Go to the source code of this file.
Classes | |
| class | moveit_fake_controller_manager::MoveItFakeControllerManager |
Namespaces | |
| namespace | moveit_fake_controller_manager |
Functions | |
| PLUGINLIB_EXPORT_CLASS (moveit_fake_controller_manager::MoveItFakeControllerManager, moveit_controller_manager::MoveItControllerManager) | |
Variables | |
| static const std::string | moveit_fake_controller_manager::DEFAULT_TYPE = "interpolate" |
| static const std::string | moveit_fake_controller_manager::ROBOT_DESCRIPTION = "robot_description" |