00001 /* 00002 * SimulatedControllerNode.cpp 00003 * 00004 * Created on: Aug 20, 2012 00005 * Author: jnicho 00006 * 00007 * Description: 00008 * This node should allows simulating a robot controller that communicates with the "joint_trajectory_action" server. 00009 * It subscribes to the topic "command" of type "trajectory_msgs/JointTrajectory" 00010 * It publishes the topic "state" of type "pr2_controllers_msgs/JointTrajectoryControllerState" 00011 * The command and state topics are published and advertised by the joint_trajectory_action server 00012 */ 00013 00014 #include <ros/ros.h> 00015 #include <object_manipulation_tools/controller_utils/SimulatedController.h> 00016 00017 int main(int argc, char** argv) 00018 { 00019 ros::init(argc,argv,"simulated_robot_controller_node"); 00020 ros::NodeHandle nh; 00021 SimulatedController simController = SimulatedController(); 00022 simController.init(); 00023 return 0; 00024 }