moveit2
The MoveIt Motion Planning Framework for ROS 2.
Namespaces | Functions
ompl_constraints.cpp File Reference
#include <algorithm>
#include <iterator>
#include <moveit/ompl_interface/detail/ompl_constraints.h>
#include <moveit/utils/logger.hpp>
#include <tf2_eigen/tf2_eigen.hpp>
Include dependency graph for ompl_constraints.cpp:

Go to the source code of this file.

Namespaces

 ompl_interface
 The MoveIt interface to OMPL.
 

Functions

std::ostream & ompl_interface::operator<< (std::ostream &os, const ompl_interface::Bounds &bounds)
 Pretty printing of bounds. More...
 
Bounds ompl_interface::positionConstraintMsgToBoundVector (const moveit_msgs::msg::PositionConstraint &pos_con)
 Extract position constraints from the MoveIt message. More...
 
Bounds ompl_interface::orientationConstraintMsgToBoundVector (const moveit_msgs::msg::OrientationConstraint &ori_con)
 Extract orientation constraints from the MoveIt message. More...
 
ompl::base::ConstraintPtr ompl_interface::createOMPLConstraints (const moveit::core::RobotModelConstPtr &robot_model, const std::string &group, const moveit_msgs::msg::Constraints &constraints)
 Factory to create constraints based on what is in the MoveIt constraint message. More...