support catkin_lint and clang-format tests in travis.yml (#93)
add queue_size parameter to all nodes, see #83 (#92)
add queue_size parameter to all nodes, see #83
add melodic badge
Contributors: Furushchev, Hironori Fujimoto, Kei Okada, higashide, iory, moju zhao
add melodic badge
Add lk flow params trackbar (#78)
${_opencv_apps_nodelet_cppfiles} adds simple_flow to library but also ${${PROJECT_NAME}_EXTRA_FILES} does same thing
Do not pefrom face recognition process without the trained data (#91)
fback_flow: add option to set 'queue_size' (#83)
travis.yml: add melodic and remove jade (#84)
[face_detection.launch] Fixed path of haarcascade xml for OpenCV-3.3.1 (#79)
Contributors: Yuki Furuta, Hironori Fujimoto, Kei Okada, Taichi Higashide, Iory Yanokura, Moju Zhao
[src/node/standalone_nodelet_exec.cpp.in] workaround for freezing imshow on kinetic (#67) * use ros::param::set instead of ros::NodeHandle("~"), that did not output NODELET_INFO * workaround for freezing imshow on kinetic
[launch/hough_circles.launch] Corrected a typo and applied the node_name argument (#69 )
[face_recognition] add nodelet / script / message files for face recognition (new) #63 from furushchev/face-recognition-new
cfg/*.cfg : Set useless use_camera_info flag to false in default (#58 )
Contributors: Kei Okada, Kentaro Wada, Yuki Furuta, wangl5
- [face_detection_nodelet.cpp] publish face roi image (#40 )
- [face_detection_nodelet.cpp] fix: use encoding BGR8 on conversion from cv::Mat to sensor_msgs/Image
- [adding_images_nodelet.cpp] Fix AddingImages (#52)
- CvtColorForDisplay is not supported until 1.11.9 (hydro)
- CvtColorForDisplayOptions is supported in 1.11.13
- Rename topic ~info to camera_info for consistency
- Do dynamic scaling for float/double images
- Support adding images whose encodings are same kind, For example adding rgb8 + bgr8
- display using cvtColorForDisplay
- Clarify with auto_beta for auto beta settings
- Check input encoding consistency
- Add arbitrary dtype images
- AddingImages: enable to set beta param if use_data is true
- [face_detection] add test for face_detection/face_image topic (#49) * test/CMakeLists.txt : skip face_detection.test * [test/test-face_detection.test] add test for face_image
- [.travis.sh] bugfix: test for opencv3 #45 * [.travis.sh] bugfix: use --upstream for rosinstall_generator to fetch not only metapackage - [.travis.sh] run test only opencv_apps package (not dep packages) - [.travis.sh] build compressed_image_transport from source if opencv3 is enabled - [package.xml] use compressed_image_transport for test_depend instead of meta package image_transport_plugins
- [doc] Better package description. (#43)
- watershed_segmentation_nodelet.cpp : Fix typo in warnnige message (#34)
- Create README.md
simplify the OpenCV3 compatibility
fix image output of fback_flow
fix error: ISO C++ forbids initialization of member for gcc 4.6
add std_srvs
add std_srvs
fix error: ISO C++ forbids initialization of member for gcc 4.6
get opencv_apps to compile with OpenCV3
fix licenses for Kei
add opencv_apps, proposed in #40
Contributors: Kei Okada, Vincent Rabaud, Yuto Inagaki