How to create a slope/ramp in Gazebo editor
Hello,
Is it possible to create a ramp in the Gazebo editor?
BR
Hello,
Is it possible to create a ramp in the Gazebo editor?
BR
The easiest way is to create a box in SDF, and give it an angle. For example:
<?xml version="1.0" ?>
<sdf version="1.4">
<world name="default">
<include>
<uri>model://ground_plane</uri>
</include>
<include>
<uri>model://sun</uri>
</include>
<model name="box">
<static>true</static>
<pose>0 0 0.2 0 0.4 0</pose>
<link name="link">
<collision name="collision">
<geometry>
<box>
<size>1 0.5 .1</size>
</box>
</geometry>
</collision>
<visual name="visual">
<geometry>
<box>
<size>1 0.5 .1</size>
</box>
</geometry>
</visual>
</link>
</model>
</world>
</sdf>
Asked: 2014-03-26 09:34:55 -0600
Seen: 7,912 times
Last updated: Mar 26 '14
Skateboard ramp in Gazebo editor
Error: "Transport endpoint is not connected" on Fedora 20
Controller / PID for controlling joints through multiple values (acceleration, velocity, position)
Contact positions wrt world frame
Problem adding gazebo_ros_control plugin in sdf model and running in gazebo
Validation between simulation and the real world
Gazebo model interaction without ros
Is possible to use Coreographe for programing in Gazebo to NAO?