[Question] Using OperationalSpaceController in the Isaac-Stack-Cube-Franka-IK-Rel-Visuomotor-v0 task. #3078
Replies: 1 comment
-
Thank you for posting this. I'll move the question to our Discussions section for follow up. Here is a summary that is still under review but it may be of help. To replace the inverse kinematics (IK) controller with the Operational Space Controller (OSC) for the Franka arm in the Isaac-Stack-Cube-Franka-IK-Rel-Visuomotor-v0 task in IsaacLab, you need to modify the task’s configuration—specifically, the controller specified under the 1. Update the Controller in the Configuration FileLocate the configuration for your environment—commonly found in a file named like self.actions.arm_action = DifferentialInverseKinematicsActionCfg(
asset_name="robot",
joint_names=["panda_joint.*"],
body_name="panda_hand",
controller=DifferentialIKControllerCfg(command_type="pose", use_relative_mode=True, ik_method="dls"), # <-- to change
scale=0.5,
# ...
) Replace the from isaaclab.controllers.operational_space_cfg import OperationalSpaceControllerCfg
self.actions.arm_action = TorqueActionCfg( # You may need to switch to TorqueActionCfg if using OSC
asset_name="robot",
joint_names=["panda_joint.*"],
body_name="panda_hand",
controller=OperationalSpaceControllerCfg(
target_types=["pose_abs"],
impedance_mode="variable_kp",
inertial_dynamics_decoupling=True,
partial_inertial_dynamics_decoupling=False,
gravity_compensation=True,
motion_control_axes_task=[1, 1, 1, 1, 1, 1],
contact_wrench_control_axes_task=[0, 0, 0, 0, 0, 0],
nullspace_control="position"
),
scale=1.0,
# You may want to specify body_offset or other params
)
2. Additional Notes
Summary: Footnotes |
Beta Was this translation helpful? Give feedback.
Uh oh!
There was an error while loading. Please reload this page.
-
Dear Developers,
I am currently conducting imitation learning research in the simulator. In the Isaac-Stack-Cube-Franka-IK-Rel-Visuomotor-v0 task provided in IsaacLab, the controller for Panda is set to IK. I would like to use the OperationalSpaceController instead. How should I modify the configuration file to achieve this? I have seen the tutorial at [(https://isaac-sim.github.io/IsaacLab/main/source/tutorials/05_controllers/run_osc.html)], but I am still unsure how to proceed and would appreciate your guidance.
Beta Was this translation helpful? Give feedback.
All reactions