jog_joint_node.h
Go to the documentation of this file.
1 #ifndef JOG_JOINT_H
2 #define JOG_JOINT_H
3 
4 #include <string>
5 #include <ros/ros.h>
6 #include <jog_msgs/JogJoint.h>
7 #include <sensor_msgs/JointState.h>
8 #include <moveit_msgs/GetPositionFK.h>
9 #include <moveit_msgs/GetPositionIK.h>
10 #include <control_msgs/FollowJointTrajectoryAction.h>
12 #include <trajectory_msgs/JointTrajectoryPoint.h>
13 #include <moveit_msgs/ExecuteTrajectoryAction.h>
14 
16 
17 namespace jog_joint
18 {
19 
20 typedef struct
21 {
22 public:
23  std::string action_ns;
24  std::string type;
25  std::vector<std::string> joints;
26 
27 } Controller;
28 
33 {
34 public:
38  JogJointNode ();
39  int get_controller_list();
40  void jog_joint_cb (jog_msgs::JogJointConstPtr msg);
41  void joint_state_cb (sensor_msgs::JointStateConstPtr msg);
42 
43 protected:
45 
46  std::map<std::string, Controller> cinfo_map_;
47  std::map<std::string, TrajClient*> traj_clients_;
48  std::map<std::string, ros::Publisher> traj_pubs_;
50 
51  std::map<std::string, double> joint_map_;
52  sensor_msgs::JointState joint_state_;
53 
58 };
59 
60 } // namespace jog_joint
61 
62 #endif // JOG_JOINT_NODE_H
msg
ros::Subscriber jog_joint_sub_
actionlib::SimpleActionClient< control_msgs::FollowJointTrajectoryAction > TrajClient
std::map< std::string, ros::Publisher > traj_pubs_
std::vector< std::string > joints
void jog_joint_cb(jog_msgs::JogJointConstPtr msg)
Callback function for the topic jog_joint.
ros::Publisher joint_state_pub_
std::map< std::string, TrajClient * > traj_clients_
std::map< std::string, double > joint_map_
void joint_state_cb(sensor_msgs::JointStateConstPtr msg)
Callback function for the topic joint_state.
std::map< std::string, Controller > cinfo_map_
ros::Subscriber joint_state_sub_
sensor_msgs::JointState joint_state_


jog_controller
Author(s): Ryosuke Tajima
autogenerated on Sun May 17 2020 03:25:01