Only released in EOL distros:
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Repository: wg-ros-pkg
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/tabletop_object_perception/tags/tabletop_object_perception-0.4.3
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/pr2_object_manipulation/branches/0.5-branch
pr2_object_manipulation: active_realtime_segmentation | fast_plane_detection | manipulation_worlds | object_recognition_gui | object_segmentation_gui | pick_and_place_demo_app | pr2_create_object_model | pr2_grasp_adjust | pr2_gripper_grasp_controller | pr2_gripper_grasp_planner_cluster | pr2_gripper_reactive_approach | pr2_gripper_sensor_action | pr2_gripper_sensor_controller | pr2_gripper_sensor_msgs | pr2_handy_tools | pr2_interactive_gripper_pose_action | pr2_interactive_manipulation | pr2_interactive_object_detection | pr2_manipulation_controllers | pr2_marker_control | pr2_navigation_controllers | pr2_object_manipulation_launch | pr2_object_manipulation_msgs | pr2_pick_and_place_demos | pr2_pick_and_place_tutorial | pr2_tabletop_manipulation_launch | pr2_wrappers | rgbd_assembler | robot_self_filter_color | segmented_clutter_grasp_planner | tabletop_collision_map_processing | tabletop_object_detector | tf_throttle
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/pr2_object_manipulation/branches/0.6-branch
Package Summary
fast_plane_detector
- Author: Jeannette Bohg
- License: BSD
- Source: svn https://code.ros.org/svn/wg-ros-pkg/stacks/pr2_object_manipulation/trunk
Overview
This package provides a method to detect the dominant 3D plane in a scene in real time. It is based on RANSAC and uses disparity images as input. It is an extracted submodule from the package active_realtime_segmentation in which it was used for detecting the dominant table plane. However, any plane orientation is possible to detect.
Starting the Fast Plane Detector
For detecting the table plane in a disparity image start the following launch file:
roslaunch fast_plane_detection fast_plane_detection_jean.launch
which starts a table plane detection node that subscribes to the topic /narrow_stereo_textured/disparity.
For detecting the local plane in a region around a specific pixel position, run the following node:
rosrun fast_plane_detection fast_region_plane_detector_jean disparity_in:=/plane_detection/disparity disparity_image_topic:=/narrow_stereo_textured/disparity cam_info_in:=/narrow_stereo_textured/left/camera_info
where the remapped topics are the output from the node run by the previous launch file.
Example Results
Here are some example results for planes extracted from the following disparity map in real time.
This is the disparity map in which the detected table plane is filtered out.
This is the disparity map in which a local plane is detected.
The table plane and the local plane detected can be visualised in Rviz.