#include <moveit/ompl_interface/ompl_interface.h>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <moveit/profiler/profiler.h>
#include <boost/math/constants/constants.hpp>
Go to the source code of this file.
Functions | |
void | computeDB (const robot_model::RobotModelPtr &robot_model, unsigned int ns, unsigned int ne) |
moveit_msgs::Constraints | getConstraints () |
int | main (int argc, char **argv) |
Variables | |
static const std::string | ROBOT_DESCRIPTION = "robot_description" |
void computeDB | ( | const robot_model::RobotModelPtr & | robot_model, |
unsigned int | ns, | ||
unsigned int | ne | ||
) |
Definition at line 64 of file demo_construct_state_database.cpp.
moveit_msgs::Constraints getConstraints | ( | ) |
Definition at line 45 of file demo_construct_state_database.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 105 of file demo_construct_state_database.cpp.
const std::string ROBOT_DESCRIPTION = "robot_description" [static] |
Definition at line 43 of file demo_construct_state_database.cpp.