HardwareX/Software Files/ROS Workspace/src/gazebo/o2s.trans
2023-02-15 09:56:11 +01:00

28 lines
1.0 KiB
XML

<?xml version="1.0" ?>
<robot name="o2s_robot" xmlns:xacro="http://www.ros.org/wiki/xacro" >
<!-- ****************** o2s base transmission******************* -->
<transmission name="rightwheel_joint_tran">
<type>transmission_interface/SimpleTransmission</type>
<joint name="rightwheel_joint">
<hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
</joint>
<actuator name="rightwheel_joint_actr">
<hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
<mechanicalReduction>1</mechanicalReduction>
</actuator>
</transmission>
<transmission name="leftwheel_joint_tran">
<type>transmission_interface/SimpleTransmission</type>
<joint name="leftwheel_joint">
<hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
</joint>
<actuator name="leftwheel_joint_actr">
<hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
<mechanicalReduction>1</mechanicalReduction>
</actuator>
</transmission>
</robot>