ROS installation on Raspberry Pi (system: raaspberrybian) failure

asked 2018-05-21 02:56:52 -0500

ros_seagull gravatar image

I'm following the provided guide ( http://wiki.ros.org/ROSberryPi/Instal... ) to try to install ROS on my raspberry pi. But it stuck at step 3.3 - Building the catkin Workspace. I have already added 1G swap space so the problem is caused by something else. The error code is as follows (I am kind of new to Linux so I can' t distinguish the most important messages and that' s why I post them all):

-- Could not find the required component 'message_generation'. The following CMake error indicates that you either need to install the package with the same name or change your environment so that it can be found.

CMake Error at /opt/ros/kinetic/share/catkin/cmake/catkinConfig.cmake:83 (find_package):
Could not find a package configuration file provided by
"message_generation" with any of the following names:

message_generationConfig.cmake
message_generation-config.cmake

Add the installation prefix of "message_generation" to CMAKE_PREFIX_PATH or
set "message_generation_DIR" to a directory containing one of the above
files.  If "message_generation" provides a separate development package or
SDK, be sure it has been installed.
Call Stack (most recent call first):
CMakeLists.txt:4 (find_package)


-- Configuring incomplete, errors occurred!
See also "/home/pi/ros_catkin_ws/build_isolated/actionlib_msgs/CMakeFiles/CMakeOutput.log".
See also "/home/pi/ros_catkin_ws/build_isolated/actionlib_msgs/CMakeFiles/CMakeError.log".
<== Failed to process package 'actionlib_msgs': 
Command '['/opt/ros/kinetic/env.sh', 'cmake', '/home/pi/ros_catkin_ws/src/common_msgs/actionlib_msgs', '-
DCATKIN_DEVEL_PREFIX=/home/pi/ros_catkin_ws/devel_isolated/actionlib_msgs', '-
DCMAKE_INSTALL_PREFIX=/opt/ros/kinetic', '-DCMAKE_BUILD_TYPE=Release', '-G', 'Unix Makefiles']' returned non-zero exit status 1

Reproduce this error by running:
==> cd /home/pi/ros_catkin_ws/build_isolated/actionlib_msgs && /opt/ros/kinetic/env.sh cmake 
/home/pi/ros_catkin_ws/src/common_msgs/actionlib_msgs -
DCATKIN_DEVEL_PREFIX=/home/pi/ros_catkin_ws/devel_isolated/actionlib_msgs -
DCMAKE_INSTALL_PREFIX=/opt/ros/kinetic -DCMAKE_BUILD_TYPE=Release -G 'Unix Makefiles'
edit retag flag offensive close merge delete