moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Implementation of the Fuzzy-Matching Trajectory Cache. More...
#include <memory>
#include <vector>
#include <moveit/robot_state/conversions.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/warehouse/moveit_message_storage.h>
#include <warehouse_ros/message_collection.h>
#include <rclcpp/rclcpp.hpp>
#include <rclcpp/logging.hpp>
#include <moveit/trajectory_cache/trajectory_cache.hpp>
Go to the source code of this file.
Namespaces | |
namespace | moveit_ros |
namespace | moveit_ros::trajectory_cache |
Functions | |
std::string | moveit_ros::trajectory_cache::getWorkspaceFrameId (const moveit::planning_interface::MoveGroupInterface &move_group, const moveit_msgs::msg::WorkspaceParameters &workspace_parameters) |
std::string | moveit_ros::trajectory_cache::getCartesianPathRequestFrameId (const moveit::planning_interface::MoveGroupInterface &move_group, const moveit_msgs::srv::GetCartesianPath::Request &path_request) |
void | moveit_ros::trajectory_cache::queryAppendRangeInclusiveWithTolerance (Query &query, const std::string &name, double center, double tolerance) |
void | moveit_ros::trajectory_cache::sortConstraints (std::vector< moveit_msgs::msg::JointConstraint > &joint_constraints, std::vector< moveit_msgs::msg::PositionConstraint > &position_constraints, std::vector< moveit_msgs::msg::OrientationConstraint > &orientation_constraints) |
Implementation of the Fuzzy-Matching Trajectory Cache.
Definition in file trajectory_cache.cpp.