Robowflex
v0.1
Making MoveIt Easy
|
A helper class to build motion planning requests for a robowflex::Planner. More...
#include <builder.h>
Public Member Functions | |
MotionRequestBuilder (const RobotConstPtr &robot) | |
Constructor. More... | |
MotionRequestBuilder (const RobotConstPtr &robot, const std::string &group_name, const std::string &planner_config="") | |
Constructor. Set planner config and group as well. More... | |
MotionRequestBuilder (const PlannerConstPtr &planner, const std::string &group_name, const std::string &planner_config="") | |
Constructor. More... | |
MotionRequestBuilder (const MotionRequestBuilder &other) | |
Copy Constructor. More... | |
MotionRequestBuilderPtr | clone () const |
Clone this request. More... | |
Configuring Builder | |
void | initialize () |
Sets defaults. More... | |
void | setPlanningGroup (const std::string &group_name) |
Set the planning group to use for this request builder. More... | |
void | setPlanner (const PlannerConstPtr &planner) |
Set the Robowflex planner to use. More... | |
Starting Configurations | |
void | setStartConfiguration (const std::vector< double > &joints) |
Set the start configuration from a vector joints. All joints are assumed to be specified and in the default order. More... | |
void | setStartConfiguration (const robot_state::RobotState &state) |
Set the start configuration from a robot state. More... | |
void | setStartConfiguration (const robot_state::RobotStatePtr &state) |
Set the start configuration from a robot state. More... | |
void | useSceneStateAsStart (const SceneConstPtr &scene) |
Use the current scene state for the starting configuration. More... | |
bool | attachObjectToStart (ScenePtr scene, const std::string &object) |
Attach an object to the current request start state. Uses object from scene, and modifies the underlying scene state. This uses attachObject() on the scene, so note that the attached object will have to be re-added to the scene. More... | |
bool | attachObjectToStartConst (const SceneConstPtr &scene, const std::string &object) |
Attach an object to the current request start state. Uses object from scene, but does not modify the underlying scene. Be aware that attached objects can collide with themselves if not removed from the provided scene. More... | |
Path Constraints | |
void | addPathPoseConstraint (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &geometry, const Eigen::Quaterniond &orientation, const Eigen::Vector3d &tolerances) |
Set a pose constraint on the path. Sets the position constraint from geometry at a pose pose, and the orientation constraint from orientation and XYZ Euler angle tolerances tolerances. More... | |
void | addPathPositionConstraint (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &geometry) |
Set a position constraint on the path. Sets the position constraint from geometry at a pose pose. More... | |
void | addPathOrientationConstraint (const std::string &ee_name, const std::string &base_name, const Eigen::Quaterniond &orientation, const Eigen::Vector3d &tolerances) |
Set an orientation constraint on the path. Sets the orientation constraint from orientation and XYZ Euler angle tolerances tolerances. More... | |
Miscellaneous Settings | |
bool | setConfig (const std::string &requested_config) |
Set the planning configuration to use for the motion planning request. Attempts to match requested_config with the planner configuration offered by planner_ that is the shortest configuration that contains requested_config as a substring. For example, specifying RRTConnect will match RRTConnectkConfigDefault , and specifying RRT will match RRTkConfigDefault and not RRTConnectkConfigDefault . More... | |
void | setAllowedPlanningTime (double allowed_planning_time) |
Set the allowed planning time in the request. More... | |
void | setNumPlanningAttempts (unsigned int num_planning_attempts) |
Set the number of planning attemps in the request. More... | |
void | setWorkspaceBounds (const moveit_msgs::WorkspaceParameters &wp) |
Sets workspace bounds of the planning request. More... | |
void | setWorkspaceBounds (const Eigen::Ref< const Eigen::VectorXd > &min, const Eigen::Ref< const Eigen::VectorXd > &max) |
Sets workspace bounds of the planning request. More... | |
bool | swapStartWithGoal () |
Swap the start and goal configurations. This is only possible when a single joint goal is specified, otherwise an error is raised. More... | |
Getters | |
planning_interface::MotionPlanRequest & | getRequest () |
Get a reference to the currently built motion planning request. More... | |
const planning_interface::MotionPlanRequest & | getRequestConst () const |
Get a const reference to the currently built motion planning request. More... | |
robot_state::RobotStatePtr | getStartConfiguration () const |
Get the start state of the request as a robot state. More... | |
robot_state::RobotStatePtr | getGoalConfiguration () const |
Get the goal state of the request as a robot state. More... | |
moveit_msgs::Constraints & | getPathConstraints () |
Get a reference to the current path constraints on the motion planning request. More... | |
const RobotConstPtr & | getRobot () const |
Get the robot for this request. More... | |
const PlannerConstPtr & | getPlanner () const |
Get the planner for this request. More... | |
const std::string & | getPlanningGroup () const |
Get the planning group. More... | |
const std::string & | getPlannerConfig () const |
Get the planner config. More... | |
IO | |
bool | toYAMLFile (const std::string &file) const |
Serialize the motion planning request to a YAML file file. More... | |
bool | fromYAMLFile (const std::string &file) |
Load a planning request from a YAML file file. More... | |
Public Member Functions inherited from robowflex::ID | |
ID () | |
Constructor. More... | |
const std::string & | getID () const |
Get the unique ID for this object. More... | |
std::size_t | getVersion () const |
Get the current version of this object. More... | |
Key | getKey () const |
Get this ID as a Key. More... | |
bool | operator== (const ID &b) const |
Compare with another ID object. More... | |
bool | operator== (const Key &b) const |
Compare with an ID Key. More... | |
Private Attributes | |
const RobotConstPtr | robot_ |
The robot to build the request for. More... | |
PlannerConstPtr | planner_ |
The planner to build the request for. More... | |
std::string | group_name_ |
The group to plan for. More... | |
robot_model::JointModelGroup * | jmg_ {nullptr} |
planning_interface::MotionPlanRequest | request_ |
The build request. More... | |
Static Private Attributes | |
static const std::string | DEFAULT_CONFIG = "RRTConnectkConfigDefault" |
Default planner configuration to use. More... | |
Goals | |
using | ConfigurationValidityCallback = std::function< bool(const robot_state::RobotState &)> |
Callback function that returns true if configuration is valid for goal set, false otherwise. More... | |
void | addGoalConfiguration (const std::vector< double > &joints) |
Add a goal configuration from a vector joints. All joints are assumed to be specified and in the default order. More... | |
void | addGoalConfiguration (const robot_state::RobotStatePtr &state) |
Add a goal configuration from a robot state. More... | |
void | addGoalConfiguration (const robot_state::RobotState &state) |
Add a goal configuration from a robot state. More... | |
void | addGoalFromIKQuery (const Robot::IKQuery &query) |
Add an IK query as a goal pose. More... | |
void | addGoalPose (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, double tolerance=0.001) |
Add a goal pose for the end-effector ee_name. Generates a sphere with radius tolerance as well as orientation tolerances of tolerance from pose. More... | |
void | addGoalRegion (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &geometry, const Eigen::Quaterniond &orientation, const Eigen::Vector3d &tolerances) |
Add a goal region for an end-effector ee_name. Sets the position constraint from geometry at a pose pose, and the orientation constraint from orientation and XYZ Euler angle tolerances tolerances. More... | |
void | addGoalRotaryTile (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &geometry, const Eigen::Quaterniond &orientation, const Eigen::Vector3d &tolerances, const RobotPose &offset, const Eigen::Vector3d &axis, unsigned int n) |
Tiles some geometry around a pose in base_name for the end-effector ee_name. The geometry is placed at offset from pose, and n copies are placed evenly rotated about axis. The desired orientation is also rotated about the axis and set for each copy. More... | |
void | addCylinderSideGrasp (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &cylinder, double distance, double depth, unsigned int n) |
Adds a set of regions to grasp a cylinder from the side. This function assumes the X-axis of the end-effector frame ee_name points "forward" for grasping. More... | |
void | setGoalConfiguration (const std::vector< double > &joints) |
Set the goal configuration from a vector joints. All joints are assumed to be specified and in the default order. More... | |
void | setGoalConfiguration (const robot_state::RobotStatePtr &state) |
Set the goal configuration from a robot state. More... | |
void | setGoalConfiguration (const robot_state::RobotState &state) |
Set the goal configuration from a robot state. More... | |
void | setGoalFromIKQuery (const Robot::IKQuery &query) |
Set the goal pose from an IK query. More... | |
void | setGoalPose (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, double tolerance=0.001) |
Set a goal pose for the end-effector ee_name. Generates a sphere with radius tolerance as well as orientation tolerances of tolerance from pose. More... | |
void | setGoalRegion (const std::string &ee_name, const std::string &base_name, const RobotPose &pose, const GeometryConstPtr &geometry, const Eigen::Quaterniond &orientation, const Eigen::Vector3d &tolerances) |
Set a goal region for an end-effector ee_name. Sets the position constraint from geometry at a pose pose, and the orientation constraint from orientation and XYZ Euler angle tolerances tolerances. More... | |
void | precomputeGoalConfigurations (std::size_t n_samples, const ScenePtr &scene, const ConfigurationValidityCallback &callback={}) |
Override the goals of this motion request with precomputed goal configurations (from the specified regions). More... | |
void | clearGoals () |
Clears all goals. More... | |
Additional Inherited Members | |
Public Types inherited from robowflex::ID | |
using | Key = std::pair< std::string, std::size_t > |
A snapshot of the state of an ID. Can be compared against another ID. More... | |
Static Public Member Functions inherited from robowflex::ID | |
static Key | getNullKey () |
Get a null key for initialization. More... | |
Protected Member Functions inherited from robowflex::ID | |
void | incrementVersion () |
Increment the version number of this object. More... | |
A helper class to build motion planning requests for a robowflex::Planner.
using robowflex::MotionRequestBuilder::ConfigurationValidityCallback = std::function<bool(const robot_state::RobotState &)> |
MotionRequestBuilder::MotionRequestBuilder | ( | const RobotConstPtr & | robot | ) |
Constructor.
[in] | robot | Robot to build planning problem for. |
Definition at line 27 of file builder.cpp.
MotionRequestBuilder::MotionRequestBuilder | ( | const RobotConstPtr & | robot, |
const std::string & | group_name, | ||
const std::string & | planner_config = "" |
||
) |
Constructor. Set planner config and group as well.
[in] | robot | Robot to build planning problem for. |
[in] | group_name | The motion planning group to build the request for. |
[in] | planner_config | Desired planning configuration to use. |
Definition at line 37 of file builder.cpp.
MotionRequestBuilder::MotionRequestBuilder | ( | const PlannerConstPtr & | planner, |
const std::string & | group_name, | ||
const std::string & | planner_config = "" |
||
) |
Constructor.
[in] | planner | The motion planner to build a request for. |
[in] | group_name | The motion planning group to build the request for. |
[in] | planner_config | Desired planning configuration to use. |
Definition at line 47 of file builder.cpp.
MotionRequestBuilder::MotionRequestBuilder | ( | const MotionRequestBuilder & | other | ) |
Copy Constructor.
[in] | other | Request to copy. |
Definition at line 58 of file builder.cpp.
void MotionRequestBuilder::addCylinderSideGrasp | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
const GeometryConstPtr & | cylinder, | ||
double | distance, | ||
double | depth, | ||
unsigned int | n | ||
) |
Adds a set of regions to grasp a cylinder from the side. This function assumes the X-axis of the end-effector frame ee_name points "forward" for grasping.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose. |
[in] | pose | The pose of the frame to be rotated about. |
[in] | cylinder | The cylinder to grasp. |
[in] | distance | The distance from the cylinder to place the regions. |
[in] | depth | The depth of boxes to create. |
[in] | n | The number of regions to create. |
Definition at line 355 of file builder.cpp.
void MotionRequestBuilder::addGoalConfiguration | ( | const robot_state::RobotState & | state | ) |
Add a goal configuration from a robot state.
[in] | state | The robot state to set ass reference. Usually from robowflex::Robot::getScratchState(). |
Definition at line 256 of file builder.cpp.
void MotionRequestBuilder::addGoalConfiguration | ( | const robot_state::RobotStatePtr & | state | ) |
Add a goal configuration from a robot state.
[in] | state | The robot state to set as pointer. Usually from robowflex::Robot::getScratchState(). |
Definition at line 251 of file builder.cpp.
void MotionRequestBuilder::addGoalConfiguration | ( | const std::vector< double > & | joints | ) |
Add a goal configuration from a vector joints. All joints are assumed to be specified and in the default order.
[in] | joints | The values of the joints to set. |
Definition at line 234 of file builder.cpp.
void MotionRequestBuilder::addGoalFromIKQuery | ( | const Robot::IKQuery & | query | ) |
Add an IK query as a goal pose.
[in] | query | IK query to construct goal from. |
Definition at line 268 of file builder.cpp.
void MotionRequestBuilder::addGoalPose | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
double | tolerance = 0.001 |
||
) |
Add a goal pose for the end-effector ee_name. Generates a sphere with radius tolerance as well as orientation tolerances of tolerance from pose.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose. |
[in] | pose | The pose of the end-effector in base_frame. |
[in] | tolerance | The tolerance to put on the pose. |
Definition at line 312 of file builder.cpp.
void MotionRequestBuilder::addGoalRegion | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
const GeometryConstPtr & | geometry, | ||
const Eigen::Quaterniond & | orientation, | ||
const Eigen::Vector3d & | tolerances | ||
) |
Add a goal region for an end-effector ee_name. Sets the position constraint from geometry at a pose pose, and the orientation constraint from orientation and XYZ Euler angle tolerances tolerances.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose and orientation. |
[in] | pose | The pose of geometry in base_frame. |
[in] | geometry | The geometry describing the position constraint. |
[in] | orientation | The desired orientation. |
[in] | tolerances | XYZ Euler angle tolerances about orientation. |
Definition at line 323 of file builder.cpp.
void MotionRequestBuilder::addGoalRotaryTile | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
const GeometryConstPtr & | geometry, | ||
const Eigen::Quaterniond & | orientation, | ||
const Eigen::Vector3d & | tolerances, | ||
const RobotPose & | offset, | ||
const Eigen::Vector3d & | axis, | ||
unsigned int | n | ||
) |
Tiles some geometry around a pose in base_name for the end-effector ee_name. The geometry is placed at offset from pose, and n copies are placed evenly rotated about axis. The desired orientation is also rotated about the axis and set for each copy.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose and orientation. |
[in] | pose | The pose of the frame to be rotated about. |
[in] | geometry | The geometry describing the position constraint. |
[in] | orientation | The desired orientation. |
[in] | tolerances | XYZ Euler angle tolerances about orientation. |
[in] | offset | Offset of the goal geometry from pose. |
[in] | axis | Axis to rotation the goal geometry and orientation about in pose. |
[in] | n | Number of rotations (evenly divided around the circle). |
Definition at line 339 of file builder.cpp.
void MotionRequestBuilder::addPathOrientationConstraint | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const Eigen::Quaterniond & | orientation, | ||
const Eigen::Vector3d & | tolerances | ||
) |
Set an orientation constraint on the path. Sets the orientation constraint from orientation and XYZ Euler angle tolerances tolerances.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of orientation. |
[in] | orientation | The desired orientation. |
[in] | tolerances | XYZ Euler angle tolerances about orientation. |
Definition at line 477 of file builder.cpp.
void MotionRequestBuilder::addPathPoseConstraint | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
const GeometryConstPtr & | geometry, | ||
const Eigen::Quaterniond & | orientation, | ||
const Eigen::Vector3d & | tolerances | ||
) |
Set a pose constraint on the path. Sets the position constraint from geometry at a pose pose, and the orientation constraint from orientation and XYZ Euler angle tolerances tolerances.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose and orientation. |
[in] | pose | The pose of geometry in base_frame. |
[in] | geometry | The geometry describing the position constraint. |
[in] | orientation | The desired orientation. |
[in] | tolerances | XYZ Euler angle tolerances about orientation. |
Definition at line 460 of file builder.cpp.
void MotionRequestBuilder::addPathPositionConstraint | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
const GeometryConstPtr & | geometry | ||
) |
Set a position constraint on the path. Sets the position constraint from geometry at a pose pose.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose. |
[in] | pose | The pose of geometry in base_frame. |
[in] | geometry | The geometry describing the position constraint. |
Definition at line 469 of file builder.cpp.
bool MotionRequestBuilder::attachObjectToStart | ( | ScenePtr | scene, |
const std::string & | object | ||
) |
Attach an object to the current request start state. Uses object from scene, and modifies the underlying scene state. This uses attachObject()
on the scene, so note that the attached object will have to be re-added to the scene.
[in] | scene | Scene to use objects from. Will be modified. |
[in] | object | Object to attach. |
Definition at line 217 of file builder.cpp.
bool MotionRequestBuilder::attachObjectToStartConst | ( | const SceneConstPtr & | scene, |
const std::string & | object | ||
) |
Attach an object to the current request start state. Uses object from scene, but does not modify the underlying scene. Be aware that attached objects can collide with themselves if not removed from the provided scene.
[in] | scene | Scene to use objects from. |
[in] | object | Object to attach. |
Definition at line 228 of file builder.cpp.
void MotionRequestBuilder::clearGoals | ( | ) |
Clears all goals.
Definition at line 442 of file builder.cpp.
MotionRequestBuilderPtr MotionRequestBuilder::clone | ( | ) | const |
bool MotionRequestBuilder::fromYAMLFile | ( | const std::string & | file | ) |
Load a planning request from a YAML file file.
[in] | file | The name of the file to load the request from. |
Definition at line 548 of file builder.cpp.
robot_state::RobotStatePtr MotionRequestBuilder::getGoalConfiguration | ( | ) | const |
Get the goal state of the request as a robot state.
Definition at line 509 of file builder.cpp.
moveit_msgs::Constraints & MotionRequestBuilder::getPathConstraints | ( | ) |
Get a reference to the current path constraints on the motion planning request.
Definition at line 487 of file builder.cpp.
const PlannerConstPtr & MotionRequestBuilder::getPlanner | ( | ) | const |
Get the planner for this request.
Definition at line 562 of file builder.cpp.
const std::string & MotionRequestBuilder::getPlannerConfig | ( | ) | const |
Get the planner config.
Definition at line 572 of file builder.cpp.
const std::string & MotionRequestBuilder::getPlanningGroup | ( | ) | const |
Get the planning group.
Definition at line 567 of file builder.cpp.
planning_interface::MotionPlanRequest & MotionRequestBuilder::getRequest | ( | ) |
Get a reference to the currently built motion planning request.
Definition at line 493 of file builder.cpp.
const planning_interface::MotionPlanRequest & MotionRequestBuilder::getRequestConst | ( | ) | const |
Get a const reference to the currently built motion planning request.
Definition at line 538 of file builder.cpp.
const RobotConstPtr & MotionRequestBuilder::getRobot | ( | ) | const |
robot_state::RobotStatePtr MotionRequestBuilder::getStartConfiguration | ( | ) | const |
Get the start state of the request as a robot state.
Definition at line 499 of file builder.cpp.
void MotionRequestBuilder::initialize | ( | ) |
Sets defaults.
Definition at line 73 of file builder.cpp.
void MotionRequestBuilder::precomputeGoalConfigurations | ( | std::size_t | n_samples, |
const ScenePtr & | scene, | ||
const ConfigurationValidityCallback & | callback = {} |
||
) |
Override the goals of this motion request with precomputed goal configurations (from the specified regions).
That is, rather than a set of sampleable goal regions, the request will have n_samples goal configurations, all sampled from the prior goal regions.
[in] | n_samples | Number of samples to precompute. |
[in] | scene | Scene to collision check against. |
[in] | callback | If provided, will only keep samples that are valid according to callback. |
Definition at line 412 of file builder.cpp.
void MotionRequestBuilder::setAllowedPlanningTime | ( | double | allowed_planning_time | ) |
Set the allowed planning time in the request.
[in] | allowed_planning_time | The allowed planning time. |
Definition at line 448 of file builder.cpp.
bool MotionRequestBuilder::setConfig | ( | const std::string & | requested_config | ) |
Set the planning configuration to use for the motion planning request. Attempts to match requested_config with the planner configuration offered by planner_ that is the shortest configuration that contains requested_config as a substring. For example, specifying RRTConnect
will match RRTConnectkConfigDefault
, and specifying RRT
will match RRTkConfigDefault
and not RRTConnectkConfigDefault
.
[in] | requested_config | The planner config to find and use. |
Definition at line 114 of file builder.cpp.
void MotionRequestBuilder::setGoalConfiguration | ( | const robot_state::RobotState & | state | ) |
Set the goal configuration from a robot state.
[in] | state | The robot state to set as reference. Usually from robowflex::Robot::getScratchState(). |
Definition at line 384 of file builder.cpp.
void MotionRequestBuilder::setGoalConfiguration | ( | const robot_state::RobotStatePtr & | state | ) |
Set the goal configuration from a robot state.
[in] | state | The robot state to set as pointer. Usually from robowflex::Robot::getScratchState(). |
Definition at line 378 of file builder.cpp.
void MotionRequestBuilder::setGoalConfiguration | ( | const std::vector< double > & | joints | ) |
Set the goal configuration from a vector joints. All joints are assumed to be specified and in the default order.
[in] | joints | The values of the joints to set. |
Definition at line 372 of file builder.cpp.
void MotionRequestBuilder::setGoalFromIKQuery | ( | const Robot::IKQuery & | query | ) |
Set the goal pose from an IK query.
[in] | query | IK query to construct goal from. |
Definition at line 390 of file builder.cpp.
void MotionRequestBuilder::setGoalPose | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
double | tolerance = 0.001 |
||
) |
Set a goal pose for the end-effector ee_name. Generates a sphere with radius tolerance as well as orientation tolerances of tolerance from pose.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose. |
[in] | pose | The pose of the end-effector in base_frame. |
[in] | tolerance | The tolerance to put on the pose. |
Definition at line 396 of file builder.cpp.
void MotionRequestBuilder::setGoalRegion | ( | const std::string & | ee_name, |
const std::string & | base_name, | ||
const RobotPose & | pose, | ||
const GeometryConstPtr & | geometry, | ||
const Eigen::Quaterniond & | orientation, | ||
const Eigen::Vector3d & | tolerances | ||
) |
Set a goal region for an end-effector ee_name. Sets the position constraint from geometry at a pose pose, and the orientation constraint from orientation and XYZ Euler angle tolerances tolerances.
[in] | ee_name | The name of the end-effector link. |
[in] | base_name | The name of the frame of reference of pose and orientation. |
[in] | pose | The pose of geometry in base_frame. |
[in] | geometry | The geometry describing the position constraint. |
[in] | orientation | The desired orientation. |
[in] | tolerances | XYZ Euler angle tolerances about orientation. |
Definition at line 403 of file builder.cpp.
void MotionRequestBuilder::setNumPlanningAttempts | ( | unsigned int | num_planning_attempts | ) |
Set the number of planning attemps in the request.
[in] | num_planning_attempts | The required time for planning attempts. |
Definition at line 454 of file builder.cpp.
void MotionRequestBuilder::setPlanner | ( | const PlannerConstPtr & | planner | ) |
Set the Robowflex planner to use.
[in] | planner | Robowflex planner to build request for. |
Definition at line 82 of file builder.cpp.
void MotionRequestBuilder::setPlanningGroup | ( | const std::string & | group_name | ) |
Set the planning group to use for this request builder.
[in] | group_name | Name of planning group. |
Definition at line 96 of file builder.cpp.
void MotionRequestBuilder::setStartConfiguration | ( | const robot_state::RobotState & | state | ) |
Set the start configuration from a robot state.
[in] | state | The robot state to set. Usually from robowflex::Robot::getScratchState(). |
Definition at line 201 of file builder.cpp.
void MotionRequestBuilder::setStartConfiguration | ( | const robot_state::RobotStatePtr & | state | ) |
Set the start configuration from a robot state.
[in] | state | The robot state to set. Usually from robowflex::Robot::getScratchState(). |
Definition at line 207 of file builder.cpp.
void MotionRequestBuilder::setStartConfiguration | ( | const std::vector< double > & | joints | ) |
Set the start configuration from a vector joints. All joints are assumed to be specified and in the default order.
[in] | joints | The values of the joints to set. |
Definition at line 189 of file builder.cpp.
void MotionRequestBuilder::setWorkspaceBounds | ( | const Eigen::Ref< const Eigen::VectorXd > & | min, |
const Eigen::Ref< const Eigen::VectorXd > & | max | ||
) |
Sets workspace bounds of the planning request.
[in] | min | XYZ vector of minimum workspace bounds. |
[in] | max | XYZ vector of maximum workspace bounds. |
Definition at line 152 of file builder.cpp.
void MotionRequestBuilder::setWorkspaceBounds | ( | const moveit_msgs::WorkspaceParameters & | wp | ) |
Sets workspace bounds of the planning request.
[in] | wp | The workspace parameters to use. |
Definition at line 146 of file builder.cpp.
bool MotionRequestBuilder::swapStartWithGoal | ( | ) |
Swap the start and goal configurations. This is only possible when a single joint goal is specified, otherwise an error is raised.
Definition at line 166 of file builder.cpp.
bool MotionRequestBuilder::toYAMLFile | ( | const std::string & | file | ) | const |
Serialize the motion planning request to a YAML file file.
[in] | file | The name of the file to serialize the request to. |
Definition at line 543 of file builder.cpp.
void MotionRequestBuilder::useSceneStateAsStart | ( | const SceneConstPtr & | scene | ) |
Use the current scene state for the starting configuration.
[in] | scene | Scene to use state from. |
Definition at line 212 of file builder.cpp.
|
staticprivate |
|
private |
|
private |
|
private |
|
private |
|
private |