I just installed PX4 on my mac M1 chip, while i run make px4_sitl gz_x500, i get below error.
How to clear it ?
..
..
CMake Error at src/modules/simulation/gz_plugins/optical_flow/CMakeLists.txt:47 (target_link_libraries):
Target “OpticalFlowSystem” links to:
gz-sim::gz-sim
but the target was not found. Possible reasons include:
* There is a typo in the target name.
* A find_package call is missing for an IMPORTED target.
* An ALIAS target is missing.
CMake Error at src/modules/simulation/gz_plugins/template_plugin/CMakeLists.txt:49 (target_link_libraries):
Target “TemplatePlugin” links to:
gz-sim::gz-sim
but the target was not found. Possible reasons include:
* There is a typo in the target name.
* A find_package call is missing for an IMPORTED target.
* An ALIAS target is missing.
CMake Error at src/modules/simulation/gz_plugins/moving_platform_controller/CMakeLists.txt:40 (target_link_libraries):
Target “MovingPlatformController” links to:
gz-sim::gz-sim
but the target was not found. Possible reasons include:
* There is a typo in the target name.
* A find_package call is missing for an IMPORTED target.
* An ALIAS target is missing.
– Generating done (0.9s)
CMake Generate step failed. Build files cannot be regenerated correctly.