You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
This next stage generates the poses used to place the object and compute the inverse kinematics for those poses - it is somewhat similar to the ``generate grasp pose`` stage from the pick serial container. We start by creating a stage to generate the poses and inheriting the task properties. We specify the pose where we want to place the object with a ``PoseStamped`` message from ``geometry_msgs`` - in this case, we choose ``y = 0.5``. We then pass the target pose to the stage with ``setPose``.
810
+
This next stage generates the poses used to place the object and compute the inverse kinematics for those poses - it is somewhat similar to the ``generate grasp pose`` stage from the pick serial container.
811
+
We start by creating a stage to generate the poses and inheriting the task properties.
812
+
We specify the pose where we want to place the object with a ``PoseStamped`` message from ``geometry_msgs`` - in this case, we choose ``y = 0.5`` in the ``"object"`` frame.
813
+
We then pass the target pose to the stage with ``setPose``.
810
814
Next, we use ``setMonitoredStage`` and pass it the pointer to the ``attach_object`` stage from earlier.
811
815
This allows the stage to know how the object is attached.
812
816
We then create a ``ComputeIK`` stage and pass it our ``GeneratePlacePose`` stage - the rest follows the same logic as above with the pick stages.
@@ -823,6 +827,7 @@ We then create a ``ComputeIK`` stage and pass it our ``GeneratePlacePose`` stage
823
827
geometry_msgs::msg::PoseStamped target_pose_msg;
824
828
target_pose_msg.header.frame_id = "object";
825
829
target_pose_msg.pose.position.y = 0.5;
830
+
target_pose_msg.pose.orientation.w = 1.0;
826
831
stage->setPose(target_pose_msg);
827
832
stage->setMonitoredStage(attach_object_stage); // Hook into attach_object_stage
828
833
@@ -831,7 +836,7 @@ We then create a ``ComputeIK`` stage and pass it our ``GeneratePlacePose`` stage
0 commit comments