Ubuntu 18.04 installs gazebo9.0 by default and starts indoor1 of Px4 Launch will report an error:
gzserver: symbol lookup error: /usr/lib/x86_64-linux-gnu/libsdformat.so.4: undefined symbol: _ZN8igniti
The reason is that the version of gazebo 9.0 is too low and needs to be upgraded to 9.13, 9.14 or 9.15 (I can use it when upgrading to 9.19) Upgrade method:
1 Uninstall the original gazebo
sudo apt-get remove gazebo*
sudo apt-get remove libgazebo*
sudo apt-get remove ros-melodic-gazebo* #kinetic noetic Corresponding changes
2 Set up the computer to accept software from package.osrfoundation.org
sudo sh -c 'echo "deb http://packages.osrfoundation.org/gazebo/ubuntu-stable `lsb_release -cs` main" > /etc/apt/sources.list.d/gazebo-stable.list'
cat /etc/apt/sources.list.d/gazebo-stable.list
#If deb http://packages.osrfoundation.org/gazebo/ubuntu-stable xenial main appears, it means no problem
xenial should be 20.04 18.04 for bio
3 Set the key
wget https://packages.osrfoundation.org/gazebo.key -O - | sudo apt-key add -
sudo apt-get update
4 Install gazebo9.1 command.
sudo apt-get install gazebo9=9.1*
//If after executing the commands sudo apt install ros-melodic-gazebo9-* sudo apt install ros-melodic-gazebo-*, gazebo starts with an error like symbol (e.g. gzserver: symbol lookup error: /usr/lib/x86_64-linux-gnu/libsdformat.so.4: undefined symbol: _ZN8igniti). You can solve this problem by running sudo apt upgrade libignition-math2 first
5 sudo apt upgrade libignition-math2
If you type gazebo in the terminal after installation, Gazebo will open and the installation will be successful.
6 Gazebo itself is independent of ROS, so you need to install the Gazebo plugin for ROS
sudo apt install ros-melodic-gazebo9-*
sudo apt install ros-melodic-gazebo-*
Read More:
- [Err] [REST.cc:205] Error in REST request Gazebo Startup Error
- Ubuntu 20.04 Desktop Install sublime-text Error: “Certificate verification failed”
- How to Solve Xmind Install Error in Ubuntu System
- NVIDIA SMI error after Ubuntu 20.04 restart [How to Solve]
- Ubuntu Server: How to Install Chrome
- Ubuntu18.04 Install ROS Error: rosdep update [How to Solve]
- [Solved] Ubuntu 20.04 Error: curl: (23) Failure writing output to destination
- How to Solve Ubuntu “Failed to fetch” Error
- Ubuntu Run Error: not syncing : VFS: Unable to mount root
- Ubuntu Error: dpkg: error processing package mysql-community-server (–configure):
- Ubuntu found an error during apt operation [How to Solve]
- [Solved] Ubuntu Eclipse C/C++ Error: launch failed.binary not found
- Linux Ubuntu Django Error: uwsgi: error while loading shared libraries: libpcre.so.1
- [Solved] ubuntu Boot Error: /dev/nume0n1p2:clean
- [Solved] Ubuntu Compile Rust Program Error: failed to run custom build command for openssl-sys v0.9.39
- Ubuntu18.04 Compile Error: android 7 FAILED [How to Solve]
- How to Solve labelme Install Error in Ubuntu
- EasyConnect linux (ubuntu 20.04) Run Error [How to Solve]
- [Solved] Ubuntu 20.04 install MATLAB and toolbox permissions Error
- linux Ubuntu Error: No command ‘setenv‘ found