#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 <warehouse_ros/database_loader.h>
#include <ros/ros.h>
Go to the source code of this file.
◆ LinkConstraintMap
◆ LinkConstraintPair
◆ collectLinkConstraints()
void collectLinkConstraints |
( |
const moveit_msgs::Constraints & |
constraints, |
|
|
LinkConstraintMap & |
lcmap |
|
) |
| |
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ ROBOT_DESCRIPTION
const std::string ROBOT_DESCRIPTION = "robot_description" |
|
static |