How to add a normal motor to gazebo_sitl

Hi everyone,

I am trying to add a normal motor to a robot I am developing in Gazebo SITL. I have seen the libgazebo_motor_model.so plugin, but I don’t think this works for my purposes since this motor model also produces a thrust and drag moment i.e. it is the motor model for spinning propellers.

I just want a normal motor that can spin a joint. How can I specify something like this and connect it through to the firmware through the airframe ?

Thanks for any input

Best regards,
Ioannis Mandralis

You can have a look how the gimbal of the Typhoon H480 model is made. I believe it uses some sort of motor on a joint:

Thank you very much for your response. However, I think this is for a gimbal joint. I only want to rotate the joint in one axis. Do you know how this could be done ?

Best,
Ioannis

You can follow this idea:

<joint name='rotor_puller_joint' type='revolute'>
      <child>rotor_puller</child>
      <parent>base_link</parent>
      <axis>
        <xyz>1 0 0</xyz>
        <limit>
          <lower>-1e+16</lower>
          <upper>1e+16</upper>
        </limit>
        <dynamics>
          <spring_reference>0</spring_reference>
          <spring_stiffness>0</spring_stiffness>
        </dynamics>
        <use_parent_model_frame>1</use_parent_model_frame>
      </axis>
    </joint>

with this, you are going to have a rotation joint