#include <sensor_msgs/JointState.h>#include <trajectory_msgs/JointTrajectory.h>#include <mtconnect_task_parser/task.h>

Go to the source code of this file.
Namespaces | |
| namespace | mtconnect_state_machine |
Functions | |
| bool | mtconnect_state_machine::parseTaskXml (const std::string &xml, std::map< std::string, trajectory_msgs::JointTrajectoryPtr > &paths, std::map< std::string, boost::shared_ptr< mtconnect::JointPoint > > &points) |
| bool | mtconnect_state_machine::toJointTrajectory (boost::shared_ptr< mtconnect::Path > &path, trajectory_msgs::JointTrajectoryPtr &traj) |