SITL Gazebo Imu.proto error

Hi, I’m trying to run sitl with gazebo. I’m issuing the command

make px4_sitl gazebo

Gazebo 9 throws the following error connected with Imu.proto

[libprotobuf ERROR google/protobuf/descriptor_database.cc:57] File already exists in database: Imu.proto
[libprotobuf FATAL google/protobuf/descriptor.cc:1164] CHECK failed: generated_database_->Add(encoded_file_descriptor, size): 
terminate called after throwing an instance of 'google::protobuf::FatalException'
  what():  CHECK failed: generated_database_->Add(encoded_file_descriptor, size): 
/home/theuser/catkin_ws/Firmware/Tools/sitl_run.sh: line 141:  7583 Aborted                 (core dumped) gzserver "${src_path}/Tools/sitl_gazebo/worlds/empty.world"

I noticed that there are two Imu.proto, original gazebo’s one in

/usr/include/gazebo-9/gazebo/msgs/proto

and one from PX4, build in sitl_gazebo/CMakeLists.txt. So it’s like gazebo is throwing error that the proto with the same name is already used.

But seems like it works for everybody besides me (haven’t found it anywhere on the forum).

Regards,