#include <moveit/warehouse/planning_scene_storage.h>
#include <moveit/warehouse/state_storage.h>
#include <moveit/warehouse/constraints_storage.h>
#include <boost/program_options/cmdline.hpp>
#include <boost/program_options/options_description.hpp>
#include <boost/program_options/parsers.hpp>
#include <boost/program_options/variables_map.hpp>
#include <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <moveit/robot_state/conversions.h>
#include <ros/ros.h>
Go to the source code of this file.
Typedefs | |
typedef std::map< std::string, LinkConstraintPair > | LinkConstraintMap |
typedef std::pair < geometry_msgs::Point, geometry_msgs::Quaternion > | LinkConstraintPair |
Functions | |
void | collectLinkConstraints (const moveit_msgs::Constraints &constraints, LinkConstraintMap &lcmap) |
int | main (int argc, char **argv) |
Variables | |
static const std::string | ROBOT_DESCRIPTION = "robot_description" |
typedef std::map<std::string, LinkConstraintPair > LinkConstraintMap |
Definition at line 51 of file save_as_text.cpp.
typedef std::pair<geometry_msgs::Point, geometry_msgs::Quaternion> LinkConstraintPair |
Definition at line 50 of file save_as_text.cpp.
void collectLinkConstraints | ( | const moveit_msgs::Constraints & | constraints, |
LinkConstraintMap & | lcmap | ||
) |
Definition at line 53 of file save_as_text.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 74 of file save_as_text.cpp.
const std::string ROBOT_DESCRIPTION = "robot_description" [static] |
Definition at line 48 of file save_as_text.cpp.