

Go to the source code of this file.
Namespaces | |
| namespace | moveit_simple_actions |
Functions | |
| int | moveit_simple_actions::findObj (std::vector< MetaBlock > *blocks, const std::string name) |
| find the object by name | |
| std::vector< std::string > | moveit_simple_actions::getObjectsList (const std::vector< MetaBlock > &blocks) |
| get a list of objects | |
| std::vector< std::string > | moveit_simple_actions::getObjectsOldList (std::vector< MetaBlock > *objects) |
| get a list of old objects | |
| void | moveit_simple_actions::setPose (geometry_msgs::Pose *pose, const double &x, const double &y, const double &z, const double &ox, const double &oy, const double &oz, const double &ow) |
| set the pose | |
| void | moveit_simple_actions::setPose (geometry_msgs::Pose *pose, const double &x, const double &y, const double &z) |
| set the pose | |
| void | moveit_simple_actions::swapPoses (geometry_msgs::Pose *pose1, geometry_msgs::Pose *pose2) |
| swap poses | |