Classes | |
| class | EigenGraspPlannerClient |
| Uses the GraspIt! services to add and load robot and objects and do the planning. This class can be used as a helper. More... | |
Functions | |
| bool | makeDirectoryIfNeeded (const std::string &dPath) |
| template<typename ROSMessage > | |
| bool | saveToFile (const ROSMessage &msg, const std::string &filename, bool asBinary) |
| bool | writeGraspMessage (const moveit_msgs::Grasp &grasp, const std::string &outputDirectory, const std::string &filenamePrefix="Grasp", const std::string &ext="msg") |
| bool grasp_planning_graspit_ros::makeDirectoryIfNeeded | ( | const std::string & | dPath | ) |
Definition at line 5 of file WriteToFile.cpp.
| bool grasp_planning_graspit_ros::saveToFile | ( | const ROSMessage & | msg, |
| const std::string & | filename, | ||
| bool | asBinary | ||
| ) |
Definition at line 20 of file WriteToFile.h.
| bool grasp_planning_graspit_ros::writeGraspMessage | ( | const moveit_msgs::Grasp & | grasp, |
| const std::string & | outputDirectory, | ||
| const std::string & | filenamePrefix = "Grasp", |
||
| const std::string & | ext = "msg" |
||
| ) |
Definition at line 75 of file WriteToFile.cpp.