moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
moveit_ros::trajectory_cache::TrajectoryCache Member List

This is the complete list of members for moveit_ros::trajectory_cache::TrajectoryCache, including all inherited members.

constructGetCartesianPathRequest(moveit::planning_interface::MoveGroupInterface &move_group, const std::vector< geometry_msgs::msg::Pose > &waypoints, double max_step, double jump_threshold, bool avoid_collisions=true)moveit_ros::trajectory_cache::TrajectoryCache
countCartesianTrajectories(const std::string &cache_namespace)moveit_ros::trajectory_cache::TrajectoryCache
countTrajectories(const std::string &cache_namespace)moveit_ros::trajectory_cache::TrajectoryCache
fetchAllMatchingCartesianTrajectories(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::srv::GetCartesianPath::Request &plan_request, double min_fraction, double start_tolerance, double goal_tolerance, bool metadata_only=false, const std::string &sort_by="execution_time_s", bool ascending=true) constmoveit_ros::trajectory_cache::TrajectoryCache
fetchAllMatchingTrajectories(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::msg::MotionPlanRequest &plan_request, double start_tolerance, double goal_tolerance, bool metadata_only=false, const std::string &sort_by="execution_time_s", bool ascending=true) constmoveit_ros::trajectory_cache::TrajectoryCache
fetchBestMatchingCartesianTrajectory(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::srv::GetCartesianPath::Request &plan_request, double min_fraction, double start_tolerance, double goal_tolerance, bool metadata_only=false, const std::string &sort_by="execution_time_s", bool ascending=true) constmoveit_ros::trajectory_cache::TrajectoryCache
fetchBestMatchingTrajectory(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::msg::MotionPlanRequest &plan_request, double start_tolerance, double goal_tolerance, bool metadata_only=false, const std::string &sort_by="execution_time_s", bool ascending=true) constmoveit_ros::trajectory_cache::TrajectoryCache
getDbPath() constmoveit_ros::trajectory_cache::TrajectoryCache
getDbPort() constmoveit_ros::trajectory_cache::TrajectoryCache
getExactMatchPrecision() constmoveit_ros::trajectory_cache::TrajectoryCache
getNumAdditionalTrajectoriesToPreserveWhenDeletingWorse() constmoveit_ros::trajectory_cache::TrajectoryCache
init(const Options &options)moveit_ros::trajectory_cache::TrajectoryCache
insertCartesianTrajectory(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::srv::GetCartesianPath::Request &plan_request, const moveit_msgs::msg::RobotTrajectory &trajectory, double execution_time_s, double planning_time_s, double fraction, bool prune_worse_trajectories=true)moveit_ros::trajectory_cache::TrajectoryCache
insertTrajectory(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::msg::MotionPlanRequest &plan_request, const moveit_msgs::msg::RobotTrajectory &trajectory, double execution_time_s, double planning_time_s, bool prune_worse_trajectories=true)moveit_ros::trajectory_cache::TrajectoryCache
setExactMatchPrecision(double exact_match_precision)moveit_ros::trajectory_cache::TrajectoryCache
setNumAdditionalTrajectoriesToPreserveWhenDeletingWorse(size_t num_additional_trajectories_to_preserve_when_deleting_worse)moveit_ros::trajectory_cache::TrajectoryCache
TrajectoryCache(const rclcpp::Node::SharedPtr &node)moveit_ros::trajectory_cache::TrajectoryCacheexplicit