[ros-users] ROS Diamondback Beta 2
Nicholas Butko
nbutko at ucsd.edu
Wed Feb 9 17:57:38 UTC 2011
Ken,
It looks like the latest beta doesn't incorporate the kdl patch for liborocos. Also it requires a patch for image_pipeline. Both patches are attached.
Several macports dependencies have not yet been incorporated, notably for perception_pcl and image_transport.
Will perception_pcl_addons be incorporated into diamondback? What about the new experimental rosjava?
The following stacks compile successfully (given patches and sufficient macports, which may not be explicitly listed)
*common
*common_msgs
*common_tutorials
*diagnostics
*diagnostics_monitors
*documentation
*driver_common
*executive_smach
*executive_smach_visualization
*geometry [REQUIRES PATCH!!!]
*geometry_tutorials
*image_common
*image_pipeline [REQUIRES PATCH!!!]
*image_transport_plugins
*laser_pipeline
*perception_pcl
*ros
*ros_comm
*ros_tutorials
*rx
*vision_opencv
The following stacks FAIL:
*geometry (due to KDL missing liborocos patch)
*image_pipeline, with error
{{{
/Users/nick/ros/diamondback_beta/image_pipeline/image_rotate/src/node/image_rotate.cpp: In member function ‘void ImageRotater::do_work(const sensor_msgs::ImageConstPtr&, std::string)’:
/Users/nick/ros/diamondback_beta/image_pipeline/image_rotate/src/node/image_rotate.cpp:152: error: call of overloaded ‘pow(int&, int)’ is ambiguous
/usr/include/architecture/i386/math.h:343: note: candidates are: double pow(double, double)
/usr/include/c++/4.2.1/cmath:373: note: long double std::pow(long double, int)
/usr/include/c++/4.2.1/cmath:369: note: float std::pow(float, int)
/usr/include/c++/4.2.1/cmath:365: note: double std::pow(double, int)
/usr/include/c++/4.2.1/cmath:361: note: long double std::pow(long double, long double)
/usr/include/c++/4.2.1/cmath:357: note: float std::pow(float, float)
/Users/nick/ros/diamondback_beta/image_pipeline/image_rotate/src/node/image_rotate.cpp:152: error: call of overloaded ‘pow(int&, int)’ is ambiguous
/usr/include/architecture/i386/math.h:343: note: candidates are: double pow(double, double)
/usr/include/c++/4.2.1/cmath:373: note: long double std::pow(long double, int)
/usr/include/c++/4.2.1/cmath:369: note: float std::pow(float, int)
/usr/include/c++/4.2.1/cmath:365: note: double std::pow(double, int)
/usr/include/c++/4.2.1/cmath:361: note: long double std::pow(long double, long double)
/usr/include/c++/4.2.1/cmath:357: note: float std::pow(float, float)
make[3]: *** [CMakeFiles/image_rotate.dir/src/node/image_rotate.o] Error 1
make[2]: *** [CMakeFiles/image_rotate.dir/all] Error 2
make[1]: *** [all] Error 2
}}}
*navigation (requires OGRE)
*robot_model (problems with colladadom -- NOTE: collada-dom is available through macports -- maybe use that instead??)
*physics_ode (problems with opende)
--Nick
-------------- next part --------------
A non-text attachment was scrubbed...
Name: image_rotate_cpp.patch
Type: application/octet-stream
Size: 704 bytes
Desc: not available
URL: <http://lists.ros.org/pipermail/ros-users/attachments/20110209/7dc32bf3/attachment-0010.obj>
-------------- next part --------------
A non-text attachment was scrubbed...
Name: kdl_Makefile.patch
Type: application/octet-stream
Size: 545 bytes
Desc: not available
URL: <http://lists.ros.org/pipermail/ros-users/attachments/20110209/7dc32bf3/attachment-0011.obj>
-------------- next part --------------
On Feb 7, 2011, at 10:57 AM, Ken Conley wrote:
> http://www.ros.org/news/2011/02/ros-diamondback-beta-2-release.html
>
> Thanks everyone for the helpful reports. We've pushed a lot of stack
> updates and are getting closer to our release candidate. We
> appreciate your continued help with integration, including the updates
> to the installation instructions on the various Linux distributions.
>
> FYI: Here are some remaining OS X integration tickets based on
> Nicholas Butko's reports, patches welcome:
>
> https://code.ros.org/trac/ros-pkg/ticket/4764
> https://code.ros.org/trac/ros-pkg/ticket/4765
> https://code.ros.org/trac/ros-pkg/ticket/4766
>
> We still have some fixes that have not been released yet, but will be
> included in the next update.
>
> - Ken
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
More information about the ros-users
mailing list