ardupilot_gazebo
ardupilot_gazebo copied to clipboard
sim_vehicle.py: command not found
hi, i recently followed the tutorial given to run simulation on gazebo. everything went smoothly without error until the following section
COPTER On 1st Terminal(Launch Ardupilot SITL)
sim_vehicle.py -v ArduCopter -f gazebo-iris --map --console On 2nd Terminal(Launch Gazebo with demo 3DR Iris model)
gazebo --verbose worlds/iris_arducopter_runway.world
I tried to run the code on the first terminal and it returned sim_vehicle.py: command not found. can you help clarify on this? thank you so much. Im new to this and would like to learn.
Ubuntu 18.04 ROS Melodic Gazebo 9
Hello,
You should have miss to reload your PATH or miss a step on SITL configuration see http://ardupilot.org/dev/docs/setting-up-sitl-on-linux.html#install-some-required-packages
Try to make SITL works without gazebo first.
$find . -name sim_vehicle.py
then use the full path name