|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
This is the complete list of members for moveit_ros::trajectory_cache::TrajectoryCache, including all inherited members.
| 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, const std::vector< std::unique_ptr< FeaturesInterface< moveit_msgs::srv::GetCartesianPath::Request > > > &features, const std::string &sort_by, bool ascending=true, bool metadata_only=false) const | moveit_ros::trajectory_cache::TrajectoryCache | |
| fetchAllMatchingTrajectories(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::msg::MotionPlanRequest &plan_request, const std::vector< std::unique_ptr< FeaturesInterface< moveit_msgs::msg::MotionPlanRequest > > > &features, const std::string &sort_by, bool ascending=true, bool metadata_only=false) const | moveit_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, const std::vector< std::unique_ptr< FeaturesInterface< moveit_msgs::srv::GetCartesianPath::Request > > > &features, const std::string &sort_by, bool ascending=true, bool metadata_only=false) const | moveit_ros::trajectory_cache::TrajectoryCache | |
| fetchBestMatchingTrajectory(const moveit::planning_interface::MoveGroupInterface &move_group, const std::string &cache_namespace, const moveit_msgs::msg::MotionPlanRequest &plan_request, const std::vector< std::unique_ptr< FeaturesInterface< moveit_msgs::msg::MotionPlanRequest > > > &features, const std::string &sort_by, bool ascending=true, bool metadata_only=false) const | moveit_ros::trajectory_cache::TrajectoryCache | |
| getDbPath() const | moveit_ros::trajectory_cache::TrajectoryCache | |
| getDbPort() const | moveit_ros::trajectory_cache::TrajectoryCache | |
| getDefaultCacheInsertPolicy() | moveit_ros::trajectory_cache::TrajectoryCache | static |
| getDefaultCartesianCacheInsertPolicy() | moveit_ros::trajectory_cache::TrajectoryCache | static |
| getDefaultCartesianFeatures(double start_tolerance, double goal_tolerance, double min_fraction) | moveit_ros::trajectory_cache::TrajectoryCache | static |
| getDefaultFeatures(double start_tolerance, double goal_tolerance) | moveit_ros::trajectory_cache::TrajectoryCache | static |
| getDefaultSortFeature() | moveit_ros::trajectory_cache::TrajectoryCache | static |
| getExactMatchPrecision() const | moveit_ros::trajectory_cache::TrajectoryCache | |
| getNumAdditionalTrajectoriesToPreserveWhenPruningWorse() const | moveit_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::srv::GetCartesianPath::Response &plan, CacheInsertPolicyInterface< moveit_msgs::srv::GetCartesianPath::Request, moveit_msgs::srv::GetCartesianPath::Response, moveit_msgs::msg::RobotTrajectory > &cache_insert_policy, bool prune_worse_trajectories=true, const std::vector< std::unique_ptr< FeaturesInterface< moveit_msgs::srv::GetCartesianPath::Request > > > &additional_features={}) | 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::planning_interface::MoveGroupInterface::Plan &plan, CacheInsertPolicyInterface< moveit_msgs::msg::MotionPlanRequest, moveit::planning_interface::MoveGroupInterface::Plan, moveit_msgs::msg::RobotTrajectory > &cache_insert_policy, bool prune_worse_trajectories=true, const std::vector< std::unique_ptr< FeaturesInterface< moveit_msgs::msg::MotionPlanRequest > > > &additional_features={}) | moveit_ros::trajectory_cache::TrajectoryCache | |
| setExactMatchPrecision(double exact_match_precision) | moveit_ros::trajectory_cache::TrajectoryCache | |
| setNumAdditionalTrajectoriesToPreserveWhenPruningWorse(size_t num_additional_trajectories_to_preserve_when_pruning_worse) | moveit_ros::trajectory_cache::TrajectoryCache | |
| TrajectoryCache(const rclcpp::Node::SharedPtr &node) | moveit_ros::trajectory_cache::TrajectoryCache | explicit |