Multi-Vehicle Simulation with Gazebo - Launch error

Hello ,

Im using ubuntu 16.04 and ros kinetic
The simulation for one drone works fine.

So i tried to follow this guide step by step to simulate 2 drones and i get this after the launch :

**raceback (most recent call last):
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/init.py”, line 306, in main
p.start()
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/parent.py”, line 268, in start
self._start_infrastructure()
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/parent.py”, line 217, in _start_infrastructure
self._load_config()
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/parent.py”, line 132, in _load_config
roslaunch_strs=self.roslaunch_strs, verbose=self.verbose)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/config.py”, line 451, in load_config_default
loader.load(f, config, verbose=verbose)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/xmlloader.py”, line 749, in load
self._load_launch(launch, ros_config, is_core=core, filename=filename, argv=argv, verbose=verbose)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/xmlloader.py”, line 721, in _load_launch
self._recurse_load(ros_config, launch.childNodes, self.root_context, None, is_core, verbose)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/xmlloader.py”, line 685, in _recurse_load
val = self._include_tag(tag, context, ros_config, default_machine, is_core, verbose)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/xmlloader.py”, line 95, in call
return f(*args, **kwds)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/xmlloader.py”, line 589, in _include_tag
inc_filename = self.resolve_args(tag.attributes[‘file’].value, context)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/xmlloader.py”, line 183, in resolve_args
return substitution_args.resolve_args(args, context=context.resolve_dict, resolve_anon=self.resolve_anon)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/substitution_args.py”, line 370, in resolve_args
resolved = _resolve_args(resolved, context, resolve_anon, commands)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/substitution_args.py”, line 383, in _resolve_args
resolved = commands[command](resolved, a, args, context)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/substitution_args.py”, line 151, in _find
source_path_to_packages=source_path_to_packages)
File “/opt/ros/kinetic/lib/python2.7/dist-packages/roslaunch/substitution_args.py”, line 197, in _find_executable
full_path = _get_executable_path(rp.get_path(args[0]), path)
File “/usr/lib/python2.7/dist-packages/rospkg/rospack.py”, line 203, in get_path
raise ResourceNotFound(name, ros_paths=self._ros_paths)
ResourceNotFound: gazebo_ros
ROS path [0]=/opt/ros/kinetic/share/ros
ROS path [1]=/home/bragg/catkin_ws/src/mavlink
ROS path [2]=/home/bragg/catkin_ws/src/mavros/libmavconn
ROS path [3]=/home/bragg/catkin_ws/src/mavros/mavros_msgs
ROS path [4]=/home/bragg/catkin_ws/src/mavros/mavros
ROS path [5]=/home/bragg/catkin_ws/src/mavros/mavros_extras
ROS path [6]=/home/bragg/catkin_ws/src/mavros/test_mavros
ROS path [7]=/opt/ros/kinetic/share
ROS path [8]=/home/bragg/src/Firmware
ROS path [9]=/home/bragg/src/Firmware/Tools/sitl_gazebo

Can someone help me please ? Thank you in advance

Tried this?

sudo apt-get install ros-kinetic-gazebo-ros-pkgs ros-kinetic-gazebo-ros-control

Hi , thank your for your help and happy new year!

i tried the command and it gives me this:

Reading package lists… Done
Building dependency tree
Reading state information… Done
Some packages could not be installed. This may mean that you have
requested an impossible situation or if you are using the unstable
distribution that some required packages have not yet been created
or been moved out of Incoming.
The following information may help to resolve the situation:

The following packages have unmet dependencies:
ros-kinetic-gazebo-ros-control : Depends: ros-kinetic-gazebo-ros but it is not going to be installed
ros-kinetic-gazebo-ros-pkgs : Depends: ros-kinetic-gazebo-dev but it is not going to be installed
Depends: ros-kinetic-gazebo-plugins but it is not going to be installed
Depends: ros-kinetic-gazebo-ros but it is not going to be installed
E: Unable to correct problems, you have held broken packages.

i tried to resolve the probleme following this link but it always shows me the same thing.
Any other suggestions please ?

E: Unable to correct problems, you have held broken packages.

Have you tried:

sudo apt-get -f install