diff --git a/ReadMe.md b/ReadMe.md new file mode 100644 index 0000000000000000000000000000000000000000..ef50c4e91ee544383ae742c750be8cc856e44341 --- /dev/null +++ b/ReadMe.md @@ -0,0 +1,49 @@ +# ROS mvBlueFOX3 camera driver + +ROS wrapper to work with [mvBlueFOX3](https://gitlab.iri.upc.edu/asantamaria/mvBlueFOX3) driver for Matrix Vision USB 3.0 cameras. + +### Software dependencies + +##### C++ LidarLite library and dependencies + +- [Matrix Vision driver](https://www.matrix-vision.com/software-drivers-en.html). Orientative installation for a Linux x86_64: + - `cd ~/Downloads` + - `wget https://www.matrix-vision.com/USB3-vision-camera-mvbluefox3.html?file=tl_files/mv11/support/mvIMPACT_Acquire/01/mvGenTL_Acquire-x86_64_ABI2-2.18.0.tgz -O mvGenTL_Acquire-x86_64_ABI2-2.18.0.tgz` + - `wget https://www.matrix-vision.com/USB3-vision-camera-mvbluefox3.html?file=tl_files/mv11/support/mvIMPACT_Acquire/01/install_mvGenTL_Acquire.sh -O install_mvGenTL_Acquire.sh` + - `sudo chmod +x install_mvGenTL_Acquire.sh` + - `./install_mvGenTL_Acquire.sh` +For detailed specifications and driver installations, please visit [Matrix +Vision Drivers and Software](https://www.matrix-vision.com/software-drivers-en.html) + +- [mvBlueFOX3](https://gitlab.iri.upc.edu/asantamaria/mvBlueFOX3) - IRI C++ library + + - Download the library: `git clone https://gitlab.iri.upc.edu/asantamaria/mvBlueFOX3.git` + - Compile and install: `cd mvBlueFOX3/build && cmake -D CMAKE_BUILD_TYPE=RELEASE .. && make -j $(nproc) && sudo make install` + +##### ROS dependencies + +- [iri_core](https://devel.iri.upc.edu/pub/labrobotica/ros/iri-ros-pkg_hydro/metapackages/iri_core) - IRI ROS metapackage + + - Move to workspace: `roscd && cd ../src` + - Download the library: `svn co https://devel.iri.upc.edu/pub/labrobotica/ros/iri-ros-pkg_hydro/metapackages/iri_core` + - Compile: `roscd && cd .. && catkin_make` + +- [sensor_msgs](http://wiki.ros.org/sensor_msgs) - ROS sensor messages + + - Install: `sudo apt-get install ros-`\<your ROS version\>`-sensor-msgs` + +### Installation + +- Move to workspace: `roscd && cd ../src` +- Clone the repository: `git clone https://gitlab.iri.upc.edu/asantamaria/iri_mvbluefox3_camera.git` +- Compile: `roscd && cd .. && catkin_make -DCMAKE_BUILD_TYPE=Release` + +### Example of usage + +- Run `roslaunch iri_mvbluefox3_camera iri_mvbluefox3_camera.launch`. +- Parameters can be set using Matrix Vision wxPropView software and loaded specifying the path in the launch file (see the included launch file for an example). +- As only one instance of Matrix Vision camera manager is allowed, the same node is set to use several cameras, instead of launching one node for each camera. + +### Support material and multimedia + +Please, visit: [**asantamaria's web page**](http://www.iri.upc.edu/people/asantamaria) \ No newline at end of file