troubles building moveit on osx indigo

asked 2015-11-25 04:34:30 -0500

jelle gravatar image

Hi,

I'm new to ROS and am interested to delve into the MoveIt project. I managed to install ROS Indigo painlessly on osx by means of this script ( thanks Mike! ). I realize that as a novice osx is perhaps not an ideal learning environment, that said, so far, so good... ;)

Next, I'd love to be able compile MoveIt on osx.

When trying to build MoveIt ( the rosdep output below suggest no homebrew packages exist ), I run into the issue of not being / not having installed the object_recognition_msgs dependency.

is it possible to side-step the object_recognition_msgsdependency?

is there a way to trace what module requires object_recognition_msgs?

any pointers on how to move on with this build are much appreciated...

thanks,

-jelle

source /opt/ros/indigo/setup.bash
mkdir moveit
cd moveit
mkdir src
cd src/
wstool init .
wstool merge https://raw.github.com/ros-planning/moveit_docs/indigo-devel/moveit.rosinstall
wstool update
cd ..

$ catkin_make_isolated --install -DCMAKE_BUILD_TYPE=Release
Base path: /Users/jelleferinga/ROS/moveit
Source space: /Users/jelleferinga/ROS/moveit/src
Build space: /Users/jelleferinga/ROS/moveit/build_isolated
Devel space: /Users/jelleferinga/ROS/moveit/devel_isolated
Install space: /Users/jelleferinga/ROS/moveit/install_isolated
Additional CMake Arguments: -DCMAKE_BUILD_TYPE=Release
~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
~~  traversing 22 packages in topological order:
~~  - moveit_msgs
~~  - moveit_planners
~~  - moveit_plugins
~~  - moveit_resources
~~  - moveit_core
~~  - moveit_controller_manager_example
~~  - moveit_fake_controller_manager
~~  - moveit_ros
~~  - moveit_ros_perception
~~  - moveit_ros_planning
~~  - moveit_planners_ompl
~~  - moveit_ros_move_group
~~  - moveit_ros_manipulation
~~  - moveit_ros_robot_interaction
~~  - moveit_ros_warehouse
~~  - moveit_ros_benchmarks
~~  - moveit_ros_planning_interface
~~  - moveit_commander
~~  - moveit_ros_visualization
~~  - moveit_ros_benchmarks_gui
~~  - moveit_setup_assistant
~~  - moveit_simple_controller_manager
~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
The packages or cmake arguments have changed, forcing cmake invocation

==> Processing catkin package: 'moveit_msgs'
==> Creating build directory: 'build_isolated/moveit_msgs'
==> cmake /Users/jelleferinga/ROS/moveit/src/moveit_msgs -DCATKIN_DEVEL_PREFIX=/Users/jelleferinga/ROS/moveit/devel_isolated/moveit_msgs -DCMAKE_INSTALL_PREFIX=/Users/jelleferinga/ROS/moveit/install_isolated -DCMAKE_BUILD_TYPE=Release -G Unix Makefiles in '/Users/jelleferinga/ROS/moveit/build_isolated/moveit_msgs'
-- The C compiler identification is AppleClang 6.1.0.6020053
-- The CXX compiler identification is AppleClang 6.1.0.6020053
-- Check for working C compiler: /Applications/Xcode.app/Contents/Developer/Toolchains/XcodeDefault.xctoolchain/usr/bin/clang
-- Check for working C compiler: /Applications/Xcode.app/Contents/Developer/Toolchains/XcodeDefault.xctoolchain/usr/bin/clang -- works
-- Detecting C compiler ABI info
-- Detecting C compiler ABI info - done
-- Detecting C compile features
-- Detecting C compile features - done
-- Check for working CXX compiler: /Applications/Xcode.app/Contents/Developer/Toolchains/XcodeDefault.xctoolchain/usr/bin/clang++
-- Check for working CXX compiler: /Applications/Xcode.app/Contents/Developer/Toolchains/XcodeDefault.xctoolchain/usr/bin/clang++ -- works
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Detecting CXX compile features
-- Detecting CXX compile features - done
-- Using CATKIN_DEVEL_PREFIX: /Users/jelleferinga/ROS/moveit/devel_isolated/moveit_msgs
-- Using CMAKE_PREFIX_PATH: /opt/ros/indigo
-- This workspace overlays: /opt/ros/indigo
-- Found PythonInterp: /usr/bin/python (found version "2.7.10") 
-- Using PYTHON_EXECUTABLE: /usr/bin/python
-- Using default Python package layout
-- Found PY_em: /usr/local/lib/python2.7/site-packages/em.pyc  
-- Using empy: /usr/local/lib/python2.7/site-packages/em.pyc
-- Using CATKIN_ENABLE_TESTING: ON
-- Call enable_testing()
-- Using CATKIN_TEST_RESULTS_DIR: /Users/jelleferinga/ROS/moveit/build_isolated/moveit_msgs/test_results
-- Found gtest: gtests will be built
-- Using Python nosetests: /usr/local/bin/nosetests-2.7
-- catkin 0.6.14
-- Using these message generators: gencpp;genlisp;genpy
CMake ...
(more)
edit retag flag offensive close merge delete