LinearController.h
Go to the documentation of this file.
1 #ifndef FETCH_SIMPLE_LINEAR_CONTROLLER_LINEAR_CONTROLLER_H
2 #define FETCH_SIMPLE_LINEAR_CONTROLLER_LINEAR_CONTROLLER_H
3 
4 // C++
5 #include <fstream>
6 #include <iostream>
7 
8 // boost
9 #include <boost/thread/mutex.hpp>
10 
11 // ROS
14 #include <control_msgs/FollowJointTrajectoryAction.h>
15 #include <geometry_msgs/TwistStamped.h>
16 #include <fetch_simple_linear_controller/LinearMoveAction.h>
17 #include <ros/ros.h>
18 #include <sensor_msgs/JointState.h>
20 #include <tf2_ros/buffer.h>
22 
24 {
25 
26 public:
28 
29 private:
30 
31  void executeLinearMove(const fetch_simple_linear_controller::LinearMoveGoalConstPtr &goal);
32 
34 
35  // topics
37 
38  // actionlib
41 
42  // TF
45 
46  control_msgs::FollowJointTrajectoryGoal hold_goal;
47 
48  std::string eef_link;
49 
50  double max_vel;
53 
54  double kp;
55  double ki;
56 };
57 
58 #endif // FETCH_SIMPLE_LINEAR_CONTROLLER_LINEAR_CONTROLLER_H
tf2_ros::Buffer tf_buffer
actionlib::SimpleActionServer< fetch_simple_linear_controller::LinearMoveAction > linear_move_server
ros::NodeHandle n
std::string eef_link
void executeLinearMove(const fetch_simple_linear_controller::LinearMoveGoalConstPtr &goal)
ros::Publisher arm_cartesian_cmd_publisher
control_msgs::FollowJointTrajectoryGoal hold_goal
ros::NodeHandle pnh
tf2_ros::TransformListener tf_listener
actionlib::SimpleActionClient< control_msgs::FollowJointTrajectoryAction > arm_control_client


fetch_simple_linear_controller
Author(s): David Kent
autogenerated on Mon Feb 28 2022 22:21:03