Simulation does not work (jmavsim and gazebo)

OS: Ubuntu 18.04

So it’s been a few months since I’ve run simulation and I am now finding neither jmavsim nor gazebo work. They had both worked in the past, so I’m not sure what changed. Any input would be very much appreciated.

jmavsim

BUILD SUCCESSFUL
Total time: 0 seconds
Options parsed, starting Sim.
Starting GUI...
3D [dev] 1.6.0-pre12-daily-experimental daily

WARNING: An illegal reflective access operation has occurred
WARNING: Illegal reflective access by javax.media.j3d.JoglPipeline (rsrc:j3dcore.jar) to method sun.awt.AppContext.getAppContext()
WARNING: Please consider reporting this to the maintainers of javax.media.j3d.JoglPipeline
WARNING: Use --illegal-access=warn to enable warnings of further illegal reflective access operations
WARNING: All illegal access operations will be denied in a future release
Inconsistency detected by ld.so: dl-lookup.c: 111: check_match: Assertion `version->filename == NULL || ! _dl_name_match_p (version->filename, map)' failed!

gazebo

-- Found GStreamer: adding gst_camera_plugin
-- Found GStreamer: adding gst_video_stream_widget
CMake Error: The following variables are used in this project, but they are set to NOTFOUND.
Please set them or make sure they are set and tested correctly in the CMake files:
GSTREAMER_LIBRARIES (ADVANCED)
    linked by target "gazebo_vision_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_uuv_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_lidar_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_geotagged_images_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_controller_interface" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "sensor_msgs" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_sonar_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_opticalflow_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "std_msgs" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_imu_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_opticalflow_mockup_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "mav_msgs" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "nav_msgs" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_wind_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "physics_msgs" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_gimbal_controller_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_mavlink_interface" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_motor_model" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_catapult_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_multirotor_base_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_magnetometer_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_usv_dynamics_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_barometer_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_parachute_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_gst_camera_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_irlock_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_gps_plugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "gazebo_video_stream_widget" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo
    linked by target "LiftDragPlugin" in directory /home/jake/code/jake/px4/Firmware/Tools/sitl_gazebo

-- Configuring incomplete, errors occurred!
See also "/home/jake/code/jake/px4/Firmware/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeOutput.log".
See also "/home/jake/code/jake/px4/Firmware/build/px4_sitl_default/build_gazebo/CMakeFiles/CMakeError.log".
FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure 

I assure you, at least as of yesterday they both work on Ubuntu 18.04. In particular if you set up your environment using the ubuntu.sh script in master.

The jmavsim issue is incorrect version of Java: jMAVSim Simulation · PX4 Developer Guide

Gstreamer issue is not something I’ve run into. Again though, possibly your environment. First thing I’d be doing is make distclean and trying again.

Thank you Hamish! I didn’t realize I needed to select Java 8.

The gazebo one is a little bit more weird because I do have the gstreamer libraries installed. I’ll keep poking at it.

Ahh I was using v1.9 of the docs and missed the ubuntu.sh script

Thanks for letting us know. The scripts are designed to work with the version they come with, so not sure how to overcome the fact that people end up a 1.9 docs when working on master.