moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Classes | Namespaces
trajectory_cache.hpp File Reference

Fuzzy-Matching Trajectory Cache. More...

#include <chrono>
#include <memory>
#include <optional>
#include <rclcpp/rclcpp.hpp>
#include <warehouse_ros/message_collection.h>
#include <warehouse_ros/database_connection.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <geometry_msgs/msg/pose.hpp>
#include <geometry_msgs/msg/pose_stamped.hpp>
#include <moveit/move_group_interface/move_group_interface.h>
#include <moveit_msgs/srv/get_cartesian_path.hpp>
Include dependency graph for trajectory_cache.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  moveit_ros::trajectory_cache::TrajectoryCache
 Trajectory Cache manager for MoveIt. More...
 
struct  moveit_ros::trajectory_cache::TrajectoryCache::Options
 

Namespaces

namespace  moveit_ros
 
namespace  moveit_ros::trajectory_cache
 

Detailed Description

Fuzzy-Matching Trajectory Cache.

Author
methylDragon

Definition in file trajectory_cache.hpp.