utilities.h
Go to the documentation of this file.
00001 
00002 /*
00003  * Copyright 2013 Southwest Research Institute
00004 
00005    Licensed under the Apache License, Version 2.0 (the "License");
00006    you may not use this file except in compliance with the License.
00007    You may obtain a copy of the License at
00008 
00009      http://www.apache.org/licenses/LICENSE-2.0
00010 
00011    Unless required by applicable law or agreed to in writing, software
00012    distributed under the License is distributed on an "AS IS" BASIS,
00013    WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
00014    See the License for the specific language governing permissions and
00015    limitations under the License.
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 /* UTILITIES_H_ */


mtconnect_state_machine
Author(s): Shaun M. Edwards
autogenerated on Mon Jan 6 2014 11:30:58