|
| FitLineSegmentToMask3D (const std::string &name, const BT::NodeConfiguration &config, const std::shared_ptr< BehaviorContext > &shared_resources) |
|
| FitLineSegmentToMask3D (const std::string &name, const BT::NodeConfiguration &config, const std::shared_ptr< BehaviorContext > &shared_resources, const common::visualization::VisualizationClient &visualization_client) |
| Alternate constructor to allow mocking the rviz_visual_tools interface. More...
|
|
| AsyncBehaviorBase (const std::string &name, const BT::NodeConfiguration &config, const std::shared_ptr< BehaviorContext > &shared_resources) |
|
virtual | ~AsyncBehaviorBase ()=default |
|
BT::NodeStatus | onStart () override |
| Required implementation of BT::StatefulActionNode::onStart(). More...
|
|
BT::NodeStatus | onRunning () override |
| Required implementation of BT::StatefulActionNode::onRunning(). More...
|
|
void | onHalted () override |
| Required implementation of BT::StatefulActionNode::onHalted(). More...
|
|
void | resetStatus () |
| Resets the internal status of this node. More...
|
|
| SharedResourcesNode (const std::string &name, const BT::NodeConfiguration &config, const std::shared_ptr< BehaviorContext > &shared_resources) |
| Constructor for SharedResourcesNode. Called by BT::BehaviorTreeFactory when creating a new behavior tree containing this node. More...
|
|
Finds the line segment that best fits a point cloud fragment.
The point cloud fragment is defined by a 3D mask over an input point cloud. The line parameters are estimated with the RANSAC algorithm. The RANSAC iterative process hypothesizes line models from random point subsets, selecting the hypothesis that explains the most points in the set. A point is considered explained by a line hypothesis (a.k.a. "inlier") if it is closer than a distance threshold to it. The output segment is contained in the resulting line, and is the shortest segment containing all inlier points.
Data Port Name | Port Type | Object Type |
point_cloud | input | sensor_msgs::msg::PointCloud2 |
masks3d | input | std::vector<moveit_studio_vision_msgs::msg::Mask3D> |
base_frame | input | std::string |
max_distance_from_line_for_inlier | input | double |
line_segment_poses | output | std::vector<geometry_msgs::msg::PoseStamped> |