#include <moveit/ompl_interface/ompl_interface.h>
#include <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <moveit/ompl_interface/model_based_planning_context.h>
#include <tf/transform_listener.h>
#include <moveit_msgs/DisplayTrajectory.h>
#include <moveit/profiler/profiler.h>
#include <moveit_msgs/GetMotionPlan.h>
Go to the source code of this file.
Classes | |
class | OMPLPlannerService |
Functions | |
int | main (int argc, char **argv) |
Variables | |
static const std::string | PLANNER_NODE_NAME = "ompl_planning" |
static const std::string | PLANNER_SERVICE_NAME = "plan_kinematic_path" |
static const std::string | ROBOT_DESCRIPTION = "robot_description" |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 121 of file ompl_planner.cpp.
const std::string PLANNER_NODE_NAME = "ompl_planning" [static] |
Definition at line 45 of file ompl_planner.cpp.
const std::string PLANNER_SERVICE_NAME = "plan_kinematic_path" [static] |
Definition at line 46 of file ompl_planner.cpp.
const std::string ROBOT_DESCRIPTION = "robot_description" [static] |
Definition at line 47 of file ompl_planner.cpp.