Skip to content
Snippets Groups Projects
Commit 28eb1b1a authored by Alejandro Lopez Gestoso's avatar Alejandro Lopez Gestoso
Browse files

Updated .gazebo files

parent 05af9aaa
No related branches found
No related tags found
No related merge requests found
robotNamespace: ana/pan_tilt
<?xml version="1.0"?>
<robot xmlns:xacro="http://www.ros.org/wiki/xacro">
<xacro:macro name="pan_tilt_gazebo" params="pan_joint_name tilt_joint_name sim_config">
<xacro:property name="properties" value="${load_yaml(sim_config)}"/>
<gazebo>
<plugin name="gazebo_ros_control" filename="libgazebo_ros_control.so">
<robotNamespace>/${properties['robotNamespace']}</robotNamespace>
<controlPeriod>0.01</controlPeriod>
<legacyModeNS>true</legacyModeNS>
</plugin>
</gazebo>
<gazebo reference="${pan_joint_name}_frame">
<mu1>0.2</mu1>
<mu2>0.2</mu2>
<material>Gazebo/Black</material>
</gazebo>
<gazebo reference="${tilt_joint_name}_frame">
<mu1>0.2</mu1>
<mu2>0.2</mu2>
<material>Gazebo/Green</material>
</gazebo>
<gazebo reference="${pan_joint_name}">
<implicitSpringDamper>true</implicitSpringDamper>
</gazebo>
<gazebo reference="${tilt_joint_name}">
<implicitSpringDamper>true</implicitSpringDamper>
</gazebo>
</xacro:macro>
</robot>
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Finish editing this message first!
Please register or to comment