#include <grasp_planning_graspit_ros/LogBindingROS.h>#include <moveit_msgs/Grasp.h>#include <boost/filesystem.hpp>#include <string>#include <fstream>

Go to the source code of this file.
Namespaces | |
| namespace | grasp_planning_graspit_ros |
Functions | |
| bool | grasp_planning_graspit_ros::makeDirectoryIfNeeded (const std::string &dPath) |
| template<typename ROSMessage > | |
| bool | grasp_planning_graspit_ros::saveToFile (const ROSMessage &msg, const std::string &filename, bool asBinary) |
| 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") |