Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
ompl_interface::ModelBasedStateSpaceFactory Class Referenceabstract

#include <model_based_state_space_factory.h>

Inheritance diagram for ompl_interface::ModelBasedStateSpaceFactory:
Inheritance graph
[legend]

Public Member Functions

virtual int canRepresentProblem (const std::string &group, const moveit_msgs::MotionPlanRequest &req, const moveit::core::RobotModelConstPtr &robot_model) const =0
 Decide whether the type of state space constructed by this factory could represent problems specified by the user request req for group group. The group group must always be specified and takes precedence over req.group_name, which may be different. More...
 
ModelBasedStateSpacePtr getNewStateSpace (const ModelBasedStateSpaceSpecification &space_spec) const
 
const std::string & getType () const
 
 ModelBasedStateSpaceFactory ()
 
virtual ~ModelBasedStateSpaceFactory ()
 

Protected Member Functions

virtual ModelBasedStateSpacePtr allocStateSpace (const ModelBasedStateSpaceSpecification &space_spec) const =0
 

Protected Attributes

std::string type_
 

Detailed Description

Definition at line 79 of file model_based_state_space_factory.h.

Constructor & Destructor Documentation

◆ ModelBasedStateSpaceFactory()

ompl_interface::ModelBasedStateSpaceFactory::ModelBasedStateSpaceFactory ( )
inline

Definition at line 82 of file model_based_state_space_factory.h.

◆ ~ModelBasedStateSpaceFactory()

virtual ompl_interface::ModelBasedStateSpaceFactory::~ModelBasedStateSpaceFactory ( )
inlinevirtual

Definition at line 86 of file model_based_state_space_factory.h.

Member Function Documentation

◆ allocStateSpace()

virtual ModelBasedStateSpacePtr ompl_interface::ModelBasedStateSpaceFactory::allocStateSpace ( const ModelBasedStateSpaceSpecification space_spec) const
protectedpure virtual

◆ canRepresentProblem()

virtual int ompl_interface::ModelBasedStateSpaceFactory::canRepresentProblem ( const std::string &  group,
const moveit_msgs::MotionPlanRequest req,
const moveit::core::RobotModelConstPtr &  robot_model 
) const
pure virtual

Decide whether the type of state space constructed by this factory could represent problems specified by the user request req for group group. The group group must always be specified and takes precedence over req.group_name, which may be different.

Implemented in ompl_interface::JointModelStateSpaceFactory, and ompl_interface::PoseModelStateSpaceFactory.

◆ getNewStateSpace()

ompl_interface::ModelBasedStateSpacePtr ompl_interface::ModelBasedStateSpaceFactory::getNewStateSpace ( const ModelBasedStateSpaceSpecification space_spec) const

Definition at line 40 of file model_based_state_space_factory.cpp.

◆ getType()

const std::string& ompl_interface::ModelBasedStateSpaceFactory::getType ( ) const
inline

Definition at line 92 of file model_based_state_space_factory.h.

Member Data Documentation

◆ type_

std::string ompl_interface::ModelBasedStateSpaceFactory::type_
protected

Definition at line 106 of file model_based_state_space_factory.h.


The documentation for this class was generated from the following files:


ompl
Author(s): Ioan Sucan
autogenerated on Wed Feb 21 2024 03:26:02