7 #include <jog_msgs/JogFrame.h> 8 #include <sensor_msgs/JointState.h> 12 #include <moveit_msgs/GetPositionFK.h> 13 #include <moveit_msgs/GetPositionIK.h> 14 #include <control_msgs/FollowJointTrajectoryAction.h> 16 #include <trajectory_msgs/JointTrajectoryPoint.h> 70 #endif // JOG_FRAME_NODE_H
actionlib::SimpleActionClient< control_msgs::FollowJointTrajectoryAction > TrajClient
ros::ServiceClient ik_client_
ros::Subscriber jog_frame_sub_
std::map< std::string, double > joint_map_
int get_controller_list()
void jog_frame_cb(jog_msgs::JogFrameConstPtr msg)
Callback function for the topic jog_frame.
geometry_msgs::PoseStamped pose_stamped_
void joint_state_cb(sensor_msgs::JointStateConstPtr msg)
Callback function for the topic joint_state.
ros::ServiceClient fk_client_
std::map< std::string, Controller > cinfo_map_
ros::Subscriber joint_state_sub_
std::map< std::string, ros::Publisher > traj_pubs_
std::vector< std::string > joints
std::vector< std::string > exclude_joints_
sensor_msgs::JointState joint_state_
std::map< std::string, TrajClient * > traj_clients_