PX4 / PX4-SITL_gazebo-classic

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.

Home Page:http://dev.px4.io/simulation-gazebo.html

Geek Repo:Geek Repo

Github PK Tool:Github PK Tool

Urgent :PC stops responding while running "make -j$(nproc) -l$(nproc)" command

arjungupta72 opened this issue · comments

System config:ROS Noetic, Ubuntu 20.04.6
I am following the Readme given in the repo, as it states after running
cmake ..
we have to run
make -j$(nproc) -l$(nproc) to build the gazebo plugins. However, while the command is running, it stops at 53% and the PC stops responding and keyboard and mouse don't work. I have to force shut down by turning off power supply.
Any idea how to resolve this?