Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018 #ifndef UTILITIES_H_
00019 #define UTILITIES_H_
00020
00021 #include <sensor_msgs/JointState.h>
00022 #include <trajectory_msgs/JointTrajectory.h>
00023 #include <mtconnect_task_parser/task.h>
00024
00025 namespace mtconnect_state_machine
00026 {
00027
00028
00029
00030 bool parseTaskXml(const std::string & xml,
00031 std::map<std::string, trajectory_msgs::JointTrajectoryPtr> & paths,
00032 std::map<std::string, boost::shared_ptr<mtconnect::JointPoint> > & points);
00033
00034 bool toJointTrajectory(boost::shared_ptr<mtconnect::Path> & path,
00035 trajectory_msgs::JointTrajectoryPtr & traj);
00036 }
00037
00038 #endif