#include <ros/ros.h>
#include <actionlib/server/action_server.h>
#include <trajectory_msgs/JointTrajectory.h>
#include <pr2_controllers_msgs/JointTrajectoryAction.h>
#include <pr2_controllers_msgs/JointTrajectoryControllerState.h>
#include <sensor_msgs/JointState.h>
#include <control_msgs/FollowJointTrajectoryFeedback.h>
#include <boost/foreach.hpp>
Go to the source code of this file.
Classes | |
class | SimulatedController |
Variables | |
const std::string | CONTROLLER_FEEDBACK_TOPIC_NAME = "feedback_states" |
const std::string | CONTROLLER_STATE_TOPIC_NAME = "state" |
const std::string | JOINT_NAMES_PARAM_NAME = "/joint_trajectory_action/joints" |
const std::string | JOINT_STATE_TOPIC_NAME = "joint_states" |
const std::string | JOINT_TRAJECTORY_TOPIC_NAME = "command" |
const std::string CONTROLLER_FEEDBACK_TOPIC_NAME = "feedback_states" |
Definition at line 53 of file SimulatedController.h.
const std::string CONTROLLER_STATE_TOPIC_NAME = "state" |
Definition at line 52 of file SimulatedController.h.
const std::string JOINT_NAMES_PARAM_NAME = "/joint_trajectory_action/joints" |
Definition at line 56 of file SimulatedController.h.
const std::string JOINT_STATE_TOPIC_NAME = "joint_states" |
Definition at line 55 of file SimulatedController.h.
const std::string JOINT_TRAJECTORY_TOPIC_NAME = "command" |
Definition at line 54 of file SimulatedController.h.