moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <joint_model_state_space_factory.h>
Public Member Functions | |
JointModelStateSpaceFactory () | |
int | canRepresentProblem (const std::string &group, const moveit_msgs::msg::MotionPlanRequest &req, const moveit::core::RobotModelConstPtr &robot_model) const override |
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. | |
Public Member Functions inherited from ompl_interface::ModelBasedStateSpaceFactory | |
ModelBasedStateSpaceFactory () | |
virtual | ~ModelBasedStateSpaceFactory () |
ModelBasedStateSpacePtr | getNewStateSpace (const ModelBasedStateSpaceSpecification &space_spec) const |
const std::string & | getType () const |
Protected Member Functions | |
ModelBasedStateSpacePtr | allocStateSpace (const ModelBasedStateSpaceSpecification &space_spec) const override |
Additional Inherited Members | |
Protected Attributes inherited from ompl_interface::ModelBasedStateSpaceFactory | |
std::string | type_ |
Definition at line 43 of file joint_model_state_space_factory.h.
ompl_interface::JointModelStateSpaceFactory::JointModelStateSpaceFactory | ( | ) |
Definition at line 40 of file joint_model_state_space_factory.cpp.
|
overrideprotectedvirtual |
Implements ompl_interface::ModelBasedStateSpaceFactory.
Definition at line 53 of file joint_model_state_space_factory.cpp.
|
overridevirtual |
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.
Implements ompl_interface::ModelBasedStateSpaceFactory.
Definition at line 45 of file joint_model_state_space_factory.cpp.