44#include <ompl/base/PlannerDataStorage.h>
58 ob::PlannerPtr
allocatePlanner(
const ob::SpaceInformationPtr& si,
const std::string& new_name,
63 ob::PlannerPtr allocatePlannerImpl(
const ob::SpaceInformationPtr& si,
const std::string& new_name,
65 bool store_planner_data =
false,
const std::string& file_path =
"");
68 inline ob::Planner* allocatePersistentPlanner(
const ob::PlannerData& data);
71 std::map<std::string, ob::PlannerPtr> planners_;
73 std::map<std::string, std::string> planner_data_storage_paths_;
76 ob::PlannerDataStorage storage_;
83 constraint_samplers::ConstraintSamplerManagerPtr csm);
183 moveit_msgs::msg::MoveItErrorCodes& error_code,
184 const rclcpp::Node::SharedPtr& node,
185 bool use_constraints_approximations)
const;
215 template <
typename T>
220 const ModelBasedStateSpaceFactoryPtr& factory,
221 const moveit_msgs::msg::MotionPlanRequest& req)
const;
223 const ModelBasedStateSpaceFactoryPtr&
getStateSpaceFactory(
const std::string& factory_type)
const;
225 const moveit_msgs::msg::MotionPlanRequest& req)
const;
268 CachedContextsPtr cached_contexts_;
#define MOVEIT_STRUCT_FORWARD(C)
~MultiQueryPlannerAllocator()
ob::PlannerPtr allocatePlanner(const ob::SpaceInformationPtr &si, const std::string &new_name, const ModelBasedPlanningContextSpecification &spec)
MultiQueryPlannerAllocator()=default
void setMaximumSolutionSegmentLength(double mssl)
planning_interface::PlannerConfigurationMap planner_configs_
All the existing planning configurations. The name of the configuration is the key of the map....
const std::map< std::string, ConfiguredPlannerAllocator > & getRegisteredPlannerAllocators() const
const ModelBasedStateSpaceFactoryPtr & getStateSpaceFactory(const std::string &factory_type) const
unsigned int max_goal_sampling_attempts_
maximum number of attempts to be made at sampling goals
double getMaximumSolutionSegmentLength() const
void setMaximumStateSamplingAttempts(unsigned int max_state_sampling_attempts)
void registerDefaultStateSpaces()
std::map< std::string, ConfiguredPlannerAllocator > known_planners_
unsigned int getMaximumGoalSamples() const
~PlanningContextManager()
const std::map< std::string, ModelBasedStateSpaceFactoryPtr > & getRegisteredStateSpaceFactories() const
void registerPlannerAllocator(const std::string &planner_id, const ConfiguredPlannerAllocator &pa)
double max_solution_segment_length_
ModelBasedPlanningContextPtr getPlanningContext(const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &req, moveit_msgs::msg::MoveItErrorCodes &error_code, const rclcpp::Node::SharedPtr &node, bool use_constraints_approximations) const
Returns a planning context to OMPLInterface, which in turn passes it to OMPLPlannerManager.
constraint_samplers::ConstraintSamplerManagerPtr constraint_sampler_manager_
unsigned int max_planning_threads_
when planning in parallel, this is the maximum number of threads to use at one time
unsigned int max_goal_samples_
maximum number of states to sample in the goal region for any planning request (when such sampling is...
unsigned int minimum_waypoint_count_
unsigned int getMaximumGoalSamplingAttempts() const
moveit::core::RobotModelConstPtr robot_model_
The kinematic model for which motion plans are computed.
ConfiguredPlannerSelector getPlannerSelector() const
void setMaximumGoalSamples(unsigned int max_goal_samples)
unsigned int getMinimumWaypointCount() const
unsigned int getMaximumStateSamplingAttempts() const
std::map< std::string, ModelBasedStateSpaceFactoryPtr > state_space_factories_
const moveit::core::RobotModelConstPtr & getRobotModel() const
void setPlannerConfigurations(const planning_interface::PlannerConfigurationMap &pconfig)
Specify configurations for the planners.
void registerDefaultPlanners()
void setMinimumWaypointCount(unsigned int mwc)
Get the minimum number of waypoints along the solution path.
void setMaximumGoalSamplingAttempts(unsigned int max_goal_sampling_attempts)
unsigned int max_state_sampling_attempts_
ConfiguredPlannerAllocator plannerSelector(const std::string &planner) const
const planning_interface::PlannerConfigurationMap & getPlannerConfigurations() const
Return the previously set planner configurations.
void registerPlannerAllocatorHelper(const std::string &planner_id)
void setMaximumPlanningThreads(unsigned int max_planning_threads)
MultiQueryPlannerAllocator planner_allocator_
Multi-query planner allocator.
void registerStateSpaceFactory(const ModelBasedStateSpaceFactoryPtr &factory)
unsigned int getMaximumPlanningThreads() const
The MoveIt interface to OMPL.
std::function< ob::PlannerPtr(const ompl::base::SpaceInformationPtr &si, const std::string &name, const ModelBasedPlanningContextSpecification &spec)> ConfiguredPlannerAllocator
std::function< ConfiguredPlannerAllocator(const std::string &planner_type)> ConfiguredPlannerSelector
std::map< std::string, PlannerConfigurationSettings > PlannerConfigurationMap
Map from PlannerConfigurationSettings.name to PlannerConfigurationSettings.
moveit_msgs::msg::MotionPlanRequest MotionPlanRequest
This namespace includes the central class for representing planning contexts.
Specify the settings for a particular planning algorithm, for a particular group. The Planner plugin ...