| 
    moveit2
    
   The MoveIt Motion Planning Framework for ROS 2. 
   | 
 
Functions | |
| PostIterationFn | getIterationPathPublisher (const rclcpp::Publisher< visualization_msgs::msg::MarkerArray >::SharedPtr &marker_publisher, const std::shared_ptr< const planning_scene::PlanningScene > &planning_scene, const moveit::core::JointModelGroup *group) | 
| Get post iteration function that publishes the EE path of the generated trajectory.   | |
| DoneFn | getSuccessTrajectoryPublisher (const rclcpp::Publisher< visualization_msgs::msg::MarkerArray >::SharedPtr &marker_publisher, const std::shared_ptr< const planning_scene::PlanningScene > &planning_scene, const moveit::core::JointModelGroup *group) | 
| Get Done function that publishes the EE path of the generated trajectory.   | |
| PostIterationFn stomp_moveit::visualization::getIterationPathPublisher | ( | const rclcpp::Publisher< visualization_msgs::msg::MarkerArray >::SharedPtr & | marker_publisher, | 
| const std::shared_ptr< const planning_scene::PlanningScene > & | planning_scene, | ||
| const moveit::core::JointModelGroup * | group | ||
| ) | 
Get post iteration function that publishes the EE path of the generated trajectory.
| marker_publisher | Marker publisher that is used to publish the path | 
| planning_scene | Current planning scene | 
| group | JointModelGroup to identify the EE tip | 
Definition at line 120 of file trajectory_visualization.hpp.


| DoneFn stomp_moveit::visualization::getSuccessTrajectoryPublisher | ( | const rclcpp::Publisher< visualization_msgs::msg::MarkerArray >::SharedPtr & | marker_publisher, | 
| const std::shared_ptr< const planning_scene::PlanningScene > & | planning_scene, | ||
| const moveit::core::JointModelGroup * | group | ||
| ) | 
Get Done function that publishes the EE path of the generated trajectory.
| marker_publisher | Marker publisher that is used to publish the path | 
| planning_scene | Current planning scene | 
| group | JointModelGroup to identify the EE tip | 
Definition at line 160 of file trajectory_visualization.hpp.

