#include <map>
#include <vector>
#include <string>
#include "ros/ros.h"
#include "industrial_msgs/CmdJointTrajectory.h"
#include "industrial_msgs/StopMotion.h"
#include "sensor_msgs/JointState.h"
#include "simple_message/smpl_msg_connection.h"
#include "simple_message/socket/tcp_client.h"
#include "simple_message/messages/joint_traj_pt_message.h"
#include "trajectory_msgs/JointTrajectory.h"
Go to the source code of this file.
Classes | |
class | industrial_robot_client::joint_trajectory_interface::JointTrajectoryInterface |
Message handler that relays joint trajectories to the robot controller. More... | |
Namespaces | |
industrial_robot_client | |
industrial_robot_client::joint_trajectory_interface | |