ros-pybullet / ros_pybullet_interface

ROS-PyBullet Interface.
https://ros-pybullet.github.io/ros_pybullet_interface/
BSD 3-Clause "New" or "Revised" License
74 stars 13 forks source link

How to add motor inertia #3

Closed rua0ra1 closed 1 year ago

rua0ra1 commented 1 year ago

Hi, I am not sure whether it is right place to ask this question. I am quite new to ros and pybullet. One of the main issue, I am facing is including motor inertia while simulating the robot. Mujoco has this option to add motor inertia to the joints. I really appreciate it if you can provide you suggestions to add motor inertia in the simulation. Thank you

cmower commented 1 year ago

Hi @RamCharanThota, this should be specified in the URDF, see here. Once you have specified that in the URDF, then PyBullet should load these parameters automatically.

rua0ra1 commented 1 year ago

Thank you for answering my question @cmower. I really appreciate it.

cmower commented 1 year ago

No problem @RamCharanThota!