1 #ifndef FETCH_SIMPLE_LINEAR_CONTROLLER_LINEAR_CONTROLLER_H 2 #define FETCH_SIMPLE_LINEAR_CONTROLLER_LINEAR_CONTROLLER_H 9 #include <boost/thread/mutex.hpp> 14 #include <control_msgs/FollowJointTrajectoryAction.h> 15 #include <geometry_msgs/TwistStamped.h> 16 #include <fetch_simple_linear_controller/LinearMoveAction.h> 18 #include <sensor_msgs/JointState.h> 31 void executeLinearMove(
const fetch_simple_linear_controller::LinearMoveGoalConstPtr &goal);
58 #endif // FETCH_SIMPLE_LINEAR_CONTROLLER_LINEAR_CONTROLLER_H tf2_ros::Buffer tf_buffer
actionlib::SimpleActionServer< fetch_simple_linear_controller::LinearMoveAction > linear_move_server
void executeLinearMove(const fetch_simple_linear_controller::LinearMoveGoalConstPtr &goal)
ros::Publisher arm_cartesian_cmd_publisher
control_msgs::FollowJointTrajectoryGoal hold_goal
tf2_ros::TransformListener tf_listener
actionlib::SimpleActionClient< control_msgs::FollowJointTrajectoryAction > arm_control_client