diff options
author | Alexis Ballier <aballier@gentoo.org> | 2019-12-10 18:31:06 +0100 |
---|---|---|
committer | Alexis Ballier <aballier@gentoo.org> | 2019-12-10 18:34:50 +0100 |
commit | 805aafb0c92c712d8c2b03d486166ffbfaab8d98 (patch) | |
tree | bf29559daf13f2113abf00b1edfd3acd03044e60 /dev-ros/gazebo_plugins | |
parent | dev-ros/gazebo_plugins: Remove old (diff) | |
download | gentoo-805aafb0c92c712d8c2b03d486166ffbfaab8d98.tar.gz gentoo-805aafb0c92c712d8c2b03d486166ffbfaab8d98.tar.bz2 gentoo-805aafb0c92c712d8c2b03d486166ffbfaab8d98.zip |
dev-ros/gazebo_plugins: fix build with opencv4
Package-Manager: Portage-2.3.81, Repoman-2.3.20
Signed-off-by: Alexis Ballier <aballier@gentoo.org>
Diffstat (limited to 'dev-ros/gazebo_plugins')
-rw-r--r-- | dev-ros/gazebo_plugins/files/ocv4.patch | 17 | ||||
-rw-r--r-- | dev-ros/gazebo_plugins/gazebo_plugins-2.8.5.ebuild | 1 |
2 files changed, 18 insertions, 0 deletions
diff --git a/dev-ros/gazebo_plugins/files/ocv4.patch b/dev-ros/gazebo_plugins/files/ocv4.patch new file mode 100644 index 000000000000..6d93feac4be9 --- /dev/null +++ b/dev-ros/gazebo_plugins/files/ocv4.patch @@ -0,0 +1,17 @@ +Index: gazebo_plugins/src/gazebo_ros_prosilica.cpp +=================================================================== +--- gazebo_plugins.orig/src/gazebo_ros_prosilica.cpp ++++ gazebo_plugins/src/gazebo_ros_prosilica.cpp +@@ -44,10 +44,8 @@ + #include <diagnostic_updater/diagnostic_updater.h> + #include <sensor_msgs/RegionOfInterest.h> + +-#include <opencv/cv.h> +-#include <opencv/highgui.h> +- +-#include <opencv/cvwimage.h> ++#include <opencv2/core/core_c.h> ++#include <opencv2/highgui/highgui_c.h> + + #include <boost/scoped_ptr.hpp> + #include <boost/bind.hpp> diff --git a/dev-ros/gazebo_plugins/gazebo_plugins-2.8.5.ebuild b/dev-ros/gazebo_plugins/gazebo_plugins-2.8.5.ebuild index af125170e28e..d2a12c5f8749 100644 --- a/dev-ros/gazebo_plugins/gazebo_plugins-2.8.5.ebuild +++ b/dev-ros/gazebo_plugins/gazebo_plugins-2.8.5.ebuild @@ -51,3 +51,4 @@ RDEPEND=" dev-ros/roslib[${PYTHON_USEDEP}] " DEPEND="${RDEPEND}" +PATCHES=( "${FILESDIR}/ocv4.patch" ) |