Classes | |
| struct | CartesianTrajectory | 
| struct | JointStateInfo | 
| struct | PickupGoalInfo | 
| struct | PlaceGoalInfo | 
Functions | |
| bool | parseOrientation (XmlRpc::XmlRpcValue &val, geometry_msgs::Quaternion &q) | 
| bool | parseOrientation (XmlRpc::XmlRpcValue &val, tf::Quaternion &q) | 
| bool | parsePoint (XmlRpc::XmlRpcValue &val, geometry_msgs::Point &point) | 
| bool | parsePose (XmlRpc::XmlRpcValue &val, geometry_msgs::Pose &pose) | 
| bool | parseTaskXml (const std::string &xml, std::map< std::string, trajectory_msgs::JointTrajectoryPtr > &paths) | 
| bool | parseTransform (XmlRpc::XmlRpcValue &val, tf::Transform &t) | 
| bool | parseVect3 (XmlRpc::XmlRpcValue &val, tf::Vector3 &v) | 
| bool | parseVect3 (XmlRpc::XmlRpcValue &val, geometry_msgs::Vector3 &v) | 
| bool | toJointTrajectory (boost::shared_ptr< mtconnect::Path > &path, trajectory_msgs::JointTrajectoryPtr &traj) | 
| bool move_arm_utils::parseOrientation | ( | XmlRpc::XmlRpcValue & | val, | 
| geometry_msgs::Quaternion & | q | ||
| ) | 
Definition at line 45 of file utilities.cpp.
| bool move_arm_utils::parseOrientation | ( | XmlRpc::XmlRpcValue & | val, | 
| tf::Quaternion & | q | ||
| ) | 
Definition at line 33 of file utilities.cpp.
| bool move_arm_utils::parsePoint | ( | XmlRpc::XmlRpcValue & | val, | 
| geometry_msgs::Point & | point | ||
| ) | 
Definition at line 24 of file utilities.cpp.
| bool move_arm_utils::parsePose | ( | XmlRpc::XmlRpcValue & | val, | 
| geometry_msgs::Pose & | pose | ||
| ) | 
Definition at line 78 of file utilities.cpp.
| bool move_arm_utils::parseTaskXml | ( | const std::string & | xml, | 
| std::map< std::string, trajectory_msgs::JointTrajectoryPtr > & | paths | ||
| ) | 
Definition at line 104 of file utilities.cpp.
| bool move_arm_utils::parseTransform | ( | XmlRpc::XmlRpcValue & | val, | 
| tf::Transform & | t | ||
| ) | 
Definition at line 91 of file utilities.cpp.
| bool move_arm_utils::parseVect3 | ( | XmlRpc::XmlRpcValue & | val, | 
| tf::Vector3 & | v | ||
| ) | 
Definition at line 66 of file utilities.cpp.
| bool move_arm_utils::parseVect3 | ( | XmlRpc::XmlRpcValue & | val, | 
| geometry_msgs::Vector3 & | v | ||
| ) | 
Definition at line 58 of file utilities.cpp.
| bool move_arm_utils::toJointTrajectory | ( | boost::shared_ptr< mtconnect::Path > & | path, | 
| trajectory_msgs::JointTrajectoryPtr & | traj | ||
| ) | 
Definition at line 145 of file utilities.cpp.