Dear Isaac,
Dear Tully,
Dear community,
I went for a ROS source installation with
./src/catkin/bin/catkin_make_isolated --install
At least, I got the following packages compiled:
~~ - catkin
~~ - genmsg
~~ - gencpp
~~ - genlisp
~~ - genpy
~~ - cpp_common
~~ - message_generation
~~ - message_runtime
~~ - mk
~~ - ros
~~ - ros_comm
~~ - rosbash
~~ - rosboost_cfg
~~ - rosbuild
~~ - rosclean
~~ - roscpp_traits
~~ - roscreate
~~ - rosgraph
~~ - roslang
~~ - roslaunch
~~ - roslisp
~~ - rosmake
~~ - rosmaster
~~ - rosmsg
~~ - rosnode
~~ - rosparam
~~ - rospy
~~ - rosservice
~~ - rostime
~~ - roscpp_serialization
~~ - rostopic
~~ - rosunit
~~ - rosconsole
~~ - roswtf
~~ - rostest
~~ - std_msgs
~~ - rosgraph_msgs
~~ - std_srvs
~~ - xmlrpcpp
~~ - roscpp
I needed to fix many issues with missing types or functions, but so far
so good. Now I got stuck in a boost-related issue. The binary boost-libs
provided by jaist as mentioned in the Wiki are not suitable for ROS. A
look in +BUILD_INFO shows dependencies to:
REQUIRES=/usr/lib/libc.so.12
REQUIRES=/usr/lib/libgcc_s.so.1
REQUIRES=/usr/lib/libm.so.0
REQUIRES=/usr/lib/libm387.so.0
REQUIRES=/usr/lib/libpthread.so.1
-> not existent
REQUIRES=/usr/lib/libstdc++.so.7
-> installed libstdc++.so.2.10.0 and libstdc��.so.2.2.10.0
I think, installing from source is necessary. catkin breaks e.g. for
rostest with boost-dependencies (see below).
Packages that I could not compile due to different reasons are:
### message_filters
### rospack
/root/catkin_workspace_root/src/rospack/src/rospack.cpp: In member
function 'bool
rospack::Rosstackage::exports_dry_package(rospack::Stackage*, const
std::string&, const std::string&, std::vector<std::basic_string<char,
std::char_traits<char>, std::allocator<char> >,
std::allocator<std::basic_string<char, std::char_traits<char>,
std::allocator<char> > > >&)':
/root/catkin_workspace_root/src/rospack/src/rospack.cpp:1032: error: no
matching function for call to 'TiXmlElement::FirstChildElement(const
std::basic_string<char, std::char_traits<char>, std::allocator<char> >&)'
/usr/pkg/include/tinyxml.h:664: note: candidates are: const
TiXmlElement* TiXmlNode::FirstChildElement() const
/usr/pkg/include/tinyxml.h:665: note: TiXmlElement*
TiXmlNode::FirstChildElement()
/usr/pkg/include/tinyxml.h:670: note: const
TiXmlElement* TiXmlNode::FirstChildElement(const char*) const
/usr/pkg/include/tinyxml.h:671: note: TiXmlElement*
TiXmlNode::FirstChildElement(const char*)
/root/catkin_workspace_root/src/rospack/src/rospack.cpp:1034: error: no
matching function for call to 'TiXmlElement::NextSiblingElement(const
std::basic_string<char, std::char_traits<char>, std::allocator<char> >&)'
### roslib
due to dependency to rospack
### rosout
problem of boost-libs as shown below
### topic_tools
again boost-libs
### rosbag
due to dependency to topic_tools
Could anybody help with these issues? Especially, the problem with
tinyxml. I think at least we need roslib to be compiled in order to
start roscore on a QNX system.
Best regards,
Stefan
### boost-libs error
+ cd /root/catkin_workspace_root/src/rostest
+ /usr/bin/env
PYTHONPATH=/root/catkin_workspace_root/install_isolated/lib/python2.7/site-packages:/root/catkin_workspace_root/build_isolated/rostest/lib/python2.7/site-packages:/root/catkin_workspace_root/install_isolated/lib/python2.7/site-packages
CATKIN_BINARY_DIR=/root/catkin_workspace_root/build_isolated/rostest
/usr/qnx650/host/qnx6/x86/usr/bin/python
/root/catkin_workspace_root/src/rostest/setup.py build --build-base
/root/catkin_workspace_root/build_isolated/rostest install
--prefix=/root/catkin_workspace_root/install_isolated
--install-scripts=/root/catkin_workspace_root/install_isolated/bin
/usr/qnx650/host/qnx6/x86/usr/bin/ntox86-ld: warning: libstdc++.so.7,
needed by /usr/pkg/lib/libboost_signals.so, not found (try using -rpath
or -rpath-link)
/usr/qnx650/host/qnx6/x86/usr/bin/ntox86-ld: warning: libm.so.0, needed
by /usr/pkg/lib/libboost_signals.so, not found (try using -rpath or
-rpath-link)
/usr/qnx650/host/qnx6/x86/usr/bin/ntox86-ld: warning: libpthread.so.1,
needed by /usr/pkg/lib/libboost_signals.so, not found (try using -rpath
or -rpath-link)
/usr/qnx650/host/qnx6/x86/usr/bin/ntox86-ld: warning: libc.so.12, needed
by /usr/pkg/lib/libboost_signals.so, not found (try using -rpath or
-rpath-link)
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__errno'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__readdir_r30'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to
`std::codecvt<wchar_t, char, __mbstate_t>::do_length(__mbstate_t&, char
const*, char const*, unsigned int) const'
/usr/pkg/lib/libboost_signals.so: undefined reference to
`std::_List_node_base::_M_unhook()'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__libc_mutex_lock'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_mutex_destroy'
/usr/pkg/lib/libboost_signals.so: undefined reference to
`std::_List_node_base::_M_reverse()'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to
`std::codecvt<wchar_t, char, __mbstate_t> const&
std::use_facet<std::codecvt<wchar_t, char, __mbstate_t> >(std::locale
const&)'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__lstat50'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__clock_gettime50'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__libc_thr_once'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to
`std::codecvt<wchar_t, char, __mbstate_t>::~codecvt()'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__libc_cond_init'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__libc_mutex_init'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_thr_getspecific'
/usr/pkg/lib/libboost_signals.so: undefined reference to
`std::_List_node_base::_M_hook(std::_List_node_base*)'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_cond_destroy'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__utime50'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_thr_keycreate'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_cond_timedwait'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__nanosleep50'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_thr_setspecific'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__libc_cond_wait'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_cond_broadcast'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `typeinfo
for std::codecvt<wchar_t, char, __mbstate_t>'
/usr/pkg/lib/libboost_signals.so: undefined reference to `dl_iterate_phdr'
/usr/pkg/lib/libboost_regex.so: undefined reference to
`std::basic_streambuf<wchar_t, std::char_traits<wchar_t> >::overflow(int)'
/usr/pkg/lib/libboost_regex.so: undefined reference to
`std::basic_streambuf<wchar_t, std::char_traits<wchar_t> >::pbackfail(int)'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__readdir30'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__opendir30'
/usr/pkg/lib/libboost_thread.so: undefined reference to `__libc_thr_yield'
/usr/pkg/lib/libboost_filesystem.so: undefined reference to `__stat50'
/usr/pkg/lib/libboost_thread.so: undefined reference to
`__libc_mutex_unlock'
/usr/pkg/lib/libboost_signals.so: undefined reference to
`std::_List_node_base::_M_transfer(std::_List_node_base*,
std::_List_node_base*)'
cc: /usr/qnx650/host/qnx6/x86/usr/bin/ntox86-ld error 1
make[2]: ***
[/root/catkin_workspace_root/devel_isolated/rosout/lib/rosout/rosout]
Error 1
make[1]: *** [CMakeFiles/rosout.dir/all] Error 2
make: *** [all] Error 2
Command failed, exiting.
> --
> You received this message because you are subscribed to a topic in the
> Google Groups "ros-sig-embedded" group.
> To unsubscribe from this topic, visit
>
https://groups.google.com/d/topic/ros-sig-embedded/cak1-QNevgo/unsubscribe.
> To unsubscribe from this group and all its topics, send an email to