Make px4_sitl gazebo error

Hello everyone,

Does any one know What’s the problem when i NO_SIM=1 make px4_sitl_default gazebo? and how should i fix it? i make sure i have installed all dependencies by using source Firmware/Tools/setup/ubuntu.sh

Thx.
Ze

terminal.pdf (147.2 KB)

pls, properly frame your question and give details specific to your problem. what is the issue?

Hi @Ranjeet .
Sorry for that.
Here is a picture showing that.

You will be possible to find the full terminal output in the terminal.pdf (152.3 KB)

Thx

this seems some protobuf version error, try reducing it to minimum version required or regenerate the file indicated having with newer version of probuf. I am not sure of this.

Thanks @Ranjeet . i install the latest protobuf following this page

Now, the error changes…

[0/4] Performing build step for 'sitl_gazebo' [1/91] Building CXX object CMakeFiles/sensor_msgs.dir/Range.pb.cc.o FAILED: CMakeFiles/sensor_msgs.dir/Range.pb.cc.o /usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dsensor_msgs_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/local/include -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/sique/src/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/sique/src/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/sique/src/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -O2 -g -DNDEBUG -fPIC -Wno-deprecated-declarations -Wno-address-of-packed-member -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/sensor_msgs.dir/Range.pb.cc.o -MF CMakeFiles/sensor_msgs.dir/Range.pb.cc.o.d -o CMakeFiles/sensor_msgs.dir/Range.pb.cc.o -c Range.pb.cc In file included from Range.pb.h:35:0, from Range.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:17:2: error: #error This file was generated by an older version of protoc which is #error This file was generated by an older version of protoc which is ^~~~~ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:18:2: error: #error incompatible with your Protocol Buffer headers. Please #error incompatible with your Protocol Buffer headers. Please ^~~~~ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:19:2: error: #error regenerate this file with a newer version of protoc. #error regenerate this file with a newer version of protoc. ^~~~~ In file included from Range.pb.h:35:0, from Range.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:158:33: error: ‘InternalMetadataWithArena’ in namespace ‘google::protobuf::internal’ does not name a type ::google::protobuf::internal::InternalMetadataWithArena _internal_metadata_; ^~~~~~~~~~~~~~~~~~~~~~~~~ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h: In member function ‘const google::protobuf::UnknownFieldSet& gazebo::msgs::Quaternion::unknown_fields() const’: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:61:47: error: no matching function for call to ‘google::protobuf::internal::InternalMetadata::unknown_fields() const’ return _internal_metadata_.unknown_fields(); ^ In file included from /usr/local/include/google/protobuf/message_lite.h:49:0, from /usr/local/include/google/protobuf/generated_enum_util.h:36, from /usr/local/include/google/protobuf/map.h:55, from /usr/local/include/google/protobuf/generated_message_table_driven.h:34, from Range.pb.h:26, from Range.pb.cc:4: /usr/local/include/google/protobuf/metadata_lite.h:87:35: note: candidate: template<class T> const T& google::protobuf::internal::InternalMetadata::unknown_fields(const T& (*)()) const PROTOBUF_ALWAYS_INLINE const T& unknown_fields( ^~~~~~~~~~~~~~ /usr/local/include/google/protobuf/metadata_lite.h:87:35: note: template argument deduction/substitution failed: In file included from Range.pb.h:35:0, from Range.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:61:47: note: candidate expects 1 argument, 0 provided return _internal_metadata_.unknown_fields(); ^ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h: In member function ‘google::protobuf::UnknownFieldSet* gazebo::msgs::Quaternion::mutable_unknown_fields()’: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:65:55: error: no matching function for call to ‘google::protobuf::internal::InternalMetadata::mutable_unknown_fields()’ return _internal_metadata_.mutable_unknown_fields(); ^ In file included from /usr/local/include/google/protobuf/message_lite.h:49:0, from /usr/local/include/google/protobuf/generated_enum_util.h:36, from /usr/local/include/google/protobuf/map.h:55, from /usr/local/include/google/protobuf/generated_message_table_driven.h:34, from Range.pb.h:26, from Range.pb.cc:4: /usr/local/include/google/protobuf/metadata_lite.h:97:29: note: candidate: template<class T> T* google::protobuf::internal::InternalMetadata::mutable_unknown_fields() PROTOBUF_ALWAYS_INLINE T* mutable_unknown_fields() { ^~~~~~~~~~~~~~~~~~~~~~ /usr/local/include/google/protobuf/metadata_lite.h:97:29: note: template argument deduction/substitution failed: In file included from Range.pb.h:35:0, from Range.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:65:55: note: couldn't deduce template parameter ‘T’ return _internal_metadata_.mutable_unknown_fields(); ^ In file included from Range.pb.cc:4:0: Range.pb.h: In member function ‘const gazebo::msgs::Quaternion& sensor_msgs::msgs::Range::_internal_orientation() const’: Range.pb.h:524:24: error: ‘_Quaternion_default_instance_’ is not a member of ‘gazebo::msgs’ &::gazebo::msgs::_Quaternion_default_instance_); ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Range.pb.cc: At global scope: Range.pb.cc:17:8: error: ‘PROTOBUF_INTERNAL_EXPORT_quaternion_2eproto’ does not name a type; did you mean ‘PROTOBUF_INTERNAL_EXPORT_Range_2eproto’? extern PROTOBUF_INTERNAL_EXPORT_quaternion_2eproto ::PROTOBUF_NAMESPACE_ID::internal::SCCInfo<0> scc_info_Quaternion_quaternion_2eproto; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ PROTOBUF_INTERNAL_EXPORT_Range_2eproto Range.pb.cc:39:8: error: ‘scc_info_Quaternion_quaternion_2eproto’ was not declared in this scope &scc_info_Quaternion_quaternion_2eproto.base,}}; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Range.pb.cc:39:8: note: suggested alternative: ‘scc_info_Range_Range_2eproto’ &scc_info_Quaternion_quaternion_2eproto.base,}}; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ scc_info_Range_Range_2eproto Range.pb.cc:86:6: error: ‘::descriptor_table_quaternion_2eproto’ has not been declared &::descriptor_table_quaternion_2eproto, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Range.pb.cc:86:6: note: suggested alternative: ‘descriptor_table_Range_2eproto’ &::descriptor_table_quaternion_2eproto, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ descriptor_table_Range_2eproto Range.pb.cc: In static member function ‘static void sensor_msgs::msgs::Range::InitAsDefaultInstance()’: Range.pb.cc:108:35: error: ‘internal_default_instance’ is not a member of ‘gazebo::msgs::Quaternion’ ::gazebo::msgs::Quaternion::internal_default_instance()); ^~~~~~~~~~~~~~~~~~~~~~~~~ At global scope: cc1plus: warning: unrecognized command line option ‘-Wno-address-of-packed-member’ [2/91] Building CXX object CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o FAILED: CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o /usr/bin/c++ -DLIBBULLET_VERSION=2.87 -DLIBBULLET_VERSION_GT_282 -Dsensor_msgs_EXPORTS -isystem /usr/include/gazebo-9 -isystem /usr/include/bullet -isystem /usr/include/simbody -isystem /usr/local/include -isystem /usr/include/sdformat-6.2 -isystem /usr/include/ignition/math4 -isystem /usr/include/OGRE -isystem /usr/include/OGRE/Terrain -isystem /usr/include/OGRE/Paging -isystem /usr/include/ignition/transport4 -isystem /usr/include/ignition/msgs1 -isystem /usr/include/ignition/common1 -isystem /usr/include/ignition/fuel_tools1 -isystem /usr/include/x86_64-linux-gnu/qt5 -isystem /usr/include/x86_64-linux-gnu/qt5/QtCore -isystem /usr/lib/x86_64-linux-gnu/qt5/mkspecs/linux-g++ -I/home/sique/src/Firmware/Tools/sitl_gazebo/include -I. -I/usr/include/eigen3 -I/usr/include/eigen3/eigen3 -I/usr/include/gazebo-9/gazebo/msgs -I/home/sique/src/Firmware/mavlink/include -isystem /usr/include/opencv -I/home/sique/src/Firmware/Tools/sitl_gazebo/external/OpticalFlow/include -I/usr/include/gstreamer-1.0 -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -isystem /usr/include/uuid -isystem /usr/include/x86_64-linux-gnu -O2 -g -DNDEBUG -fPIC -Wno-deprecated-declarations -Wno-address-of-packed-member -I/usr/include/uuid -I/usr/include/x86_64-linux-gnu -std=gnu++1z -MD -MT CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o -MF CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o.d -o CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o -c Imu.pb.cc In file included from Imu.pb.h:35:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:17:2: error: #error This file was generated by an older version of protoc which is #error This file was generated by an older version of protoc which is ^~~~~ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:18:2: error: #error incompatible with your Protocol Buffer headers. Please #error incompatible with your Protocol Buffer headers. Please ^~~~~ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:19:2: error: #error regenerate this file with a newer version of protoc. #error regenerate this file with a newer version of protoc. ^~~~~ In file included from Imu.pb.h:36:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:17:2: error: #error This file was generated by an older version of protoc which is #error This file was generated by an older version of protoc which is ^~~~~ /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:18:2: error: #error incompatible with your Protocol Buffer headers. Please #error incompatible with your Protocol Buffer headers. Please ^~~~~ /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:19:2: error: #error regenerate this file with a newer version of protoc. #error regenerate this file with a newer version of protoc. ^~~~~ In file included from Imu.pb.h:35:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:158:33: error: ‘InternalMetadataWithArena’ in namespace ‘google::protobuf::internal’ does not name a type ::google::protobuf::internal::InternalMetadataWithArena _internal_metadata_; ^~~~~~~~~~~~~~~~~~~~~~~~~ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h: In member function ‘const google::protobuf::UnknownFieldSet& gazebo::msgs::Quaternion::unknown_fields() const’: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:61:47: error: no matching function for call to ‘google::protobuf::internal::InternalMetadata::unknown_fields() const’ return _internal_metadata_.unknown_fields(); ^ In file included from /usr/local/include/google/protobuf/message_lite.h:49:0, from /usr/local/include/google/protobuf/generated_enum_util.h:36, from /usr/local/include/google/protobuf/map.h:55, from /usr/local/include/google/protobuf/generated_message_table_driven.h:34, from Imu.pb.h:26, from Imu.pb.cc:4: /usr/local/include/google/protobuf/metadata_lite.h:87:35: note: candidate: template<class T> const T& google::protobuf::internal::InternalMetadata::unknown_fields(const T& (*)()) const PROTOBUF_ALWAYS_INLINE const T& unknown_fields( ^~~~~~~~~~~~~~ /usr/local/include/google/protobuf/metadata_lite.h:87:35: note: template argument deduction/substitution failed: In file included from Imu.pb.h:35:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:61:47: note: candidate expects 1 argument, 0 provided return _internal_metadata_.unknown_fields(); ^ /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h: In member function ‘google::protobuf::UnknownFieldSet* gazebo::msgs::Quaternion::mutable_unknown_fields()’: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:65:55: error: no matching function for call to ‘google::protobuf::internal::InternalMetadata::mutable_unknown_fields()’ return _internal_metadata_.mutable_unknown_fields(); ^ In file included from /usr/local/include/google/protobuf/message_lite.h:49:0, from /usr/local/include/google/protobuf/generated_enum_util.h:36, from /usr/local/include/google/protobuf/map.h:55, from /usr/local/include/google/protobuf/generated_message_table_driven.h:34, from Imu.pb.h:26, from Imu.pb.cc:4: /usr/local/include/google/protobuf/metadata_lite.h:97:29: note: candidate: template<class T> T* google::protobuf::internal::InternalMetadata::mutable_unknown_fields() PROTOBUF_ALWAYS_INLINE T* mutable_unknown_fields() { ^~~~~~~~~~~~~~~~~~~~~~ /usr/local/include/google/protobuf/metadata_lite.h:97:29: note: template argument deduction/substitution failed: In file included from Imu.pb.h:35:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/quaternion.pb.h:65:55: note: couldn't deduce template parameter ‘T’ return _internal_metadata_.mutable_unknown_fields(); ^ In file included from Imu.pb.h:36:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h: At global scope: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:149:33: error: ‘InternalMetadataWithArena’ in namespace ‘google::protobuf::internal’ does not name a type ::google::protobuf::internal::InternalMetadataWithArena _internal_metadata_; ^~~~~~~~~~~~~~~~~~~~~~~~~ /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h: In member function ‘const google::protobuf::UnknownFieldSet& gazebo::msgs::Vector3d::unknown_fields() const’: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:61:47: error: no matching function for call to ‘google::protobuf::internal::InternalMetadata::unknown_fields() const’ return _internal_metadata_.unknown_fields(); ^ In file included from /usr/local/include/google/protobuf/message_lite.h:49:0, from /usr/local/include/google/protobuf/generated_enum_util.h:36, from /usr/local/include/google/protobuf/map.h:55, from /usr/local/include/google/protobuf/generated_message_table_driven.h:34, from Imu.pb.h:26, from Imu.pb.cc:4: /usr/local/include/google/protobuf/metadata_lite.h:87:35: note: candidate: template<class T> const T& google::protobuf::internal::InternalMetadata::unknown_fields(const T& (*)()) const PROTOBUF_ALWAYS_INLINE const T& unknown_fields( ^~~~~~~~~~~~~~ /usr/local/include/google/protobuf/metadata_lite.h:87:35: note: template argument deduction/substitution failed: In file included from Imu.pb.h:36:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:61:47: note: candidate expects 1 argument, 0 provided return _internal_metadata_.unknown_fields(); ^ /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h: In member function ‘google::protobuf::UnknownFieldSet* gazebo::msgs::Vector3d::mutable_unknown_fields()’: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:65:55: error: no matching function for call to ‘google::protobuf::internal::InternalMetadata::mutable_unknown_fields()’ return _internal_metadata_.mutable_unknown_fields(); ^ In file included from /usr/local/include/google/protobuf/message_lite.h:49:0, from /usr/local/include/google/protobuf/generated_enum_util.h:36, from /usr/local/include/google/protobuf/map.h:55, from /usr/local/include/google/protobuf/generated_message_table_driven.h:34, from Imu.pb.h:26, from Imu.pb.cc:4: /usr/local/include/google/protobuf/metadata_lite.h:97:29: note: candidate: template<class T> T* google::protobuf::internal::InternalMetadata::mutable_unknown_fields() PROTOBUF_ALWAYS_INLINE T* mutable_unknown_fields() { ^~~~~~~~~~~~~~~~~~~~~~ /usr/local/include/google/protobuf/metadata_lite.h:97:29: note: template argument deduction/substitution failed: In file included from Imu.pb.h:36:0, from Imu.pb.cc:4: /usr/include/gazebo-9/gazebo/msgs/vector3d.pb.h:65:55: note: couldn't deduce template parameter ‘T’ return _internal_metadata_.mutable_unknown_fields(); ^ In file included from Imu.pb.cc:4:0: Imu.pb.h: In member function ‘const gazebo::msgs::Quaternion& sensor_msgs::msgs::Imu::_internal_orientation() const’: Imu.pb.h:397:24: error: ‘_Quaternion_default_instance_’ is not a member of ‘gazebo::msgs’ &::gazebo::msgs::_Quaternion_default_instance_); ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.h: In member function ‘const gazebo::msgs::Vector3d& sensor_msgs::msgs::Imu::_internal_angular_velocity() const’: Imu.pb.h:523:24: error: ‘_Vector3d_default_instance_’ is not a member of ‘gazebo::msgs’ &::gazebo::msgs::_Vector3d_default_instance_); ^~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.h: In member function ‘const gazebo::msgs::Vector3d& sensor_msgs::msgs::Imu::_internal_linear_acceleration() const’: Imu.pb.h:649:24: error: ‘_Vector3d_default_instance_’ is not a member of ‘gazebo::msgs’ &::gazebo::msgs::_Vector3d_default_instance_); ^~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc: At global scope: Imu.pb.cc:17:8: error: ‘PROTOBUF_INTERNAL_EXPORT_quaternion_2eproto’ does not name a type; did you mean ‘PROTOBUF_INTERNAL_EXPORT_Imu_2eproto’? extern PROTOBUF_INTERNAL_EXPORT_quaternion_2eproto ::PROTOBUF_NAMESPACE_ID::internal::SCCInfo<0> scc_info_Quaternion_quaternion_2eproto; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ PROTOBUF_INTERNAL_EXPORT_Imu_2eproto Imu.pb.cc:18:8: error: ‘PROTOBUF_INTERNAL_EXPORT_vector3d_2eproto’ does not name a type; did you mean ‘PROTOBUF_INTERNAL_EXPORT_Imu_2eproto’? extern PROTOBUF_INTERNAL_EXPORT_vector3d_2eproto ::PROTOBUF_NAMESPACE_ID::internal::SCCInfo<0> scc_info_Vector3d_vector3d_2eproto; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ PROTOBUF_INTERNAL_EXPORT_Imu_2eproto Imu.pb.cc:40:8: error: ‘scc_info_Quaternion_quaternion_2eproto’ was not declared in this scope &scc_info_Quaternion_quaternion_2eproto.base, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc:41:8: error: ‘scc_info_Vector3d_vector3d_2eproto’ was not declared in this scope &scc_info_Vector3d_vector3d_2eproto.base,}}; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc:41:8: note: suggested alternative: ‘scc_info_Imu_Imu_2eproto’ &scc_info_Vector3d_vector3d_2eproto.base,}}; ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ scc_info_Imu_Imu_2eproto Imu.pb.cc:91:6: error: ‘::descriptor_table_quaternion_2eproto’ has not been declared &::descriptor_table_quaternion_2eproto, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc:91:6: note: suggested alternative: ‘descriptor_table_protodef_Imu_2eproto’ &::descriptor_table_quaternion_2eproto, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ descriptor_table_protodef_Imu_2eproto Imu.pb.cc:92:6: error: ‘::descriptor_table_vector3d_2eproto’ has not been declared &::descriptor_table_vector3d_2eproto, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc:92:6: note: suggested alternative: ‘descriptor_table_Imu_2eproto’ &::descriptor_table_vector3d_2eproto, ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ descriptor_table_Imu_2eproto Imu.pb.cc: In static member function ‘static void sensor_msgs::msgs::Imu::InitAsDefaultInstance()’: Imu.pb.cc:114:35: error: ‘internal_default_instance’ is not a member of ‘gazebo::msgs::Quaternion’ ::gazebo::msgs::Quaternion::internal_default_instance()); ^~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc:116:33: error: ‘internal_default_instance’ is not a member of ‘gazebo::msgs::Vector3d’ ::gazebo::msgs::Vector3d::internal_default_instance()); ^~~~~~~~~~~~~~~~~~~~~~~~~ Imu.pb.cc:118:33: error: ‘internal_default_instance’ is not a member of ‘gazebo::msgs::Vector3d’ ::gazebo::msgs::Vector3d::internal_default_instance()); ^~~~~~~~~~~~~~~~~~~~~~~~~ At global scope: cc1plus: warning: unrecognized command line option ‘-Wno-address-of-packed-member’ ninja: build stopped: subcommand failed. FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-build cd /home/sique/src/Firmware/build/px4_sitl_default/build_gazebo && /usr/bin/cmake --build /home/sique/src/Firmware/build/px4_sitl_default/build_gazebo -- -j2 ninja: build stopped: subcommand failed. Makefile:217: recipe for target 'px4_sitl_default' failed make: *** [px4_sitl_default] Error 1

You are not supposed to install the latest version. The error says that a file was created with older version of protobuf and there is some sort of incompatibility of the file with the newer version of protobuf installed on ur system.
Infact, you should find out which version of protobuf the file was created with and downgrade to that version. You should install older version of protobuf.

1 Like

I had this issue on Ubuntu 16.04 and not 18 I believe, Ranjeet is right. You have to roll back your protoc version