Bases: object
Builds a MoveGroupGoal.
Example:
# To do a reachability check from the current robot pose.
builder = MoveItGoalBuilder()
builder.set_pose_goal(pose_stamped)
builder.allowed_planning_time = 5
builder.plan_only = True
goal = builder.build()
# To move to a current robot pose with a few options changed.
builder = MoveItGoalBuilder()
builder.set_pose_goal(pose_stamped)
builder.replan = True
builder.replan_attempts = 10
goal = builder.build()
Use set_pose_goal or set_joint_goal to set the actual goal. Pose goals and joint goals are mutually exclusive; setting one will overwrite the other.
Most of the builder is configured by setting public members. Below is a list of all the public members you can set as well as their default values:
Adds an orientation constraint to the path.
Note
Make more advanced edits to the orientation constraints by modifying _orientation_constraints directly.
Parameters: | o_constraint (moveit_msgs.msg.OrientationConstraint) – The orientation constraint to add. |
---|
Builds the goal message.
To set a pose or joint goal, call set_pose_goal or set_joint_goal before calling build. To add a path orientation constraint, call add_path_orientation_constraint first.
Parameters: | tf_timeout (rospy.Duration) – How long to wait for a TF message. Only used with pose goals. |
---|---|
Returns: | The MoveGroup action goal. |
Return type: | moveit_msgs.msg.MoveGroupGoal |