Classes | |
| class | Action |
| Class for motion planning based on move_group. More... | |
| class | Evaluation |
| Class for evaluation the algorithm. More... | |
| class | MetaBlock |
| Class for working with collision objects. More... | |
| class | ObjProcessor |
| Class for processing objects recognized by ORK. More... | |
| class | Posture |
| Class for the robot's posture processing. More... | |
| class | SimplePickPlace |
| Class for running the main pipeline. More... | |
Functions | |
| int | findObj (std::vector< MetaBlock > *blocks, const std::string name) |
| find the object by name | |
| std::vector< std::string > | getObjectsList (const std::vector< MetaBlock > &blocks) |
| get a list of objects | |
| std::vector< std::string > | getObjectsOldList (std::vector< MetaBlock > *objects) |
| get a list of old objects | |
| void | printAllActions () |
| void | printTutorial (const std::string robot_name) |
| bool | promptUser () |
| int | promptUserAction () |
| double | promptUserInt (const std::string command) |
| bool | promptUserQuestion (const std::string command) |
| std::string | promptUserQuestionString () |
| double | promptUserValue (const std::string command) |
| void | 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 | setPose (geometry_msgs::Pose *pose, const double &x, const double &y, const double &z) |
| set the pose | |
| void | swapPoses (geometry_msgs::Pose *pose1, geometry_msgs::Pose *pose2) |
| swap poses | |
| template<typename T > | |
| void | waitForAction (const T &action, const ros::NodeHandle &node_handle, const ros::Duration &wait_for_server, const std::string &name) |
| wait for action | |
| int moveit_simple_actions::findObj | ( | std::vector< MetaBlock > * | blocks, |
| const std::string | name | ||
| ) |
find the object by name
Definition at line 50 of file toolsForObject.cpp.
| std::vector< std::string > moveit_simple_actions::getObjectsList | ( | const std::vector< MetaBlock > & | blocks | ) |
get a list of objects
Definition at line 62 of file toolsForObject.cpp.
| std::vector< std::string > moveit_simple_actions::getObjectsOldList | ( | std::vector< MetaBlock > * | objects | ) |
get a list of old objects
Definition at line 76 of file toolsForObject.cpp.
| void moveit_simple_actions::printTutorial | ( | const std::string | robot_name | ) |
| bool moveit_simple_actions::promptUser | ( | ) |
| double moveit_simple_actions::promptUserInt | ( | const std::string | command | ) |
| bool moveit_simple_actions::promptUserQuestion | ( | const std::string | command | ) |
| std::string moveit_simple_actions::promptUserQuestionString | ( | ) |
| double moveit_simple_actions::promptUserValue | ( | const std::string | command | ) |
| 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
Definition at line 22 of file toolsForObject.cpp.
| void moveit_simple_actions::setPose | ( | geometry_msgs::Pose * | pose, |
| const double & | x, | ||
| const double & | y, | ||
| const double & | z | ||
| ) |
set the pose
Definition at line 40 of file toolsForObject.cpp.
| void moveit_simple_actions::swapPoses | ( | geometry_msgs::Pose * | pose1, |
| geometry_msgs::Pose * | pose2 | ||
| ) |
swap poses
Definition at line 93 of file toolsForObject.cpp.
| void moveit_simple_actions::waitForAction | ( | const T & | action, |
| const ros::NodeHandle & | node_handle, | ||
| const ros::Duration & | wait_for_server, | ||
| const std::string & | name | ||
| ) |
wait for action
Definition at line 28 of file toolsForAction.hpp.