|
Scan-N-Plan
7.0.0
|
Behavior tree plugins for constructing Scan-N-Plan application workflows. More...
Classes | |
| class | snp_application::ButtonApprovalNode |
| Action node that listens to the state of two Qt buttons to succeed or fail the. More... | |
| class | snp_application::ButtonMonitorNode |
| Condition node that monitors the state of a Qt button. More... | |
| class | snp_application::CreateJointStateMessage |
Creates a sensor_msgs/JointState message from a set of joint names and joint positions. More... | |
| class | snp_application::ExtractApproachProcessDepartureTrajectoriesNode |
| Extracts an approach, process, and departure trajectory from a nominal trajectory. More... | |
| class | snp_application::LoadTrajectoryFromFileNode |
Loads a trajectory from a YAML file into a joint_trajectory_msgs/JointTrajectory message. More... | |
| class | snp_application::ProgressDecoratorNode |
| Decorator node that changes the state of a Qt progress bar. More... | |
| class | snp_application::SetPageDecoratorNode |
| Decorator node that sets the page of a Qt stacked widget. More... | |
| class | snp_application::SnpRosServiceNode< T > |
| Wrapper around the ROS service node that writes error messages to the ERROR_MESSAGE_KEY in the behavior tree blackboard. More... | |
| class | snp_application::SnpRosActionNode< T > |
| Wrapper around the ROS action node that writes error messages to the ERROR_MESSAGE_KEY in the behavior tree blackboard. More... | |
| class | snp_application::TriggerServiceNode |
Calls a std_srvs/Trigger service. More... | |
| class | snp_application::EmptyServiceNode |
Calls a std_srvs/Empty service. More... | |
| class | snp_application::GenerateMotionPlanServiceNode |
Calls a snp_msgs/GenerateMotionPlan service. More... | |
| class | snp_application::AddScanLinkServiceNode |
Calls a snp_msgs/AddScanLink service. More... | |
| class | snp_application::GenerateFreespaceMotionPlanServiceNode |
Calls a snp_msgs/GenerateFreespaceMotionPlan service. More... | |
| class | snp_application::PlanToolPathServiceNode |
Calls a noether_ros/PlanToolPath service. More... | |
| class | snp_application::StartReconstructionServiceNode |
Calls a industrial_reconstruction_msgs/StartReconstruction service. More... | |
| class | snp_application::StopReconstructionServiceNode |
Calls a industrial_reconstruction_msgs/StopReconstruction service. More... | |
| class | snp_application::ToolPathsPubNode |
Publishes a geometry_msgs/PoseArray message (e.g., to visualize a tool path) More... | |
| class | snp_application::MotionPlanPubNode |
Publishes a trajectory_msgs/JointTrajectory message (e.g., for visualizing a planned motion) More... | |
| class | snp_application::FollowJointTrajectoryActionNode |
Calls a control_msgs/FollowJointTrajectory action. More... | |
| class | snp_application::UpdateTrajectoryStartStateNode |
| Updates the start state of the input trajectory with the current state of the robot, assuming the two are within some threshold of one another. More... | |
| class | snp_application::ReverseTrajectoryNode |
| Reverses a trajectory. More... | |
| class | snp_application::CombineTrajectoriesNode |
| Concatenates two trajectories into a single trajectory. More... | |
| class | snp_application::GetCurrentJointStateNode |
Subscribes to a sensor_msgs/JointState topic to extract the current joint state of the robot. More... | |
| class | snp_application::RosSpinnerNode |
| Condition node for spinning the BT ROS node to keep it accessible for parameter updates, service calls, etc. More... | |
| class | snp_application::SNPSequenceWithMemory |
| Sequence control node that maintains the index of the current child node for direct re-entry in the case of halts or failures. More... | |
| class | snp_application::TextEditLogger |
| Logs a subset of node status changes to a Qt text edit widget. More... | |