-
Notifications
You must be signed in to change notification settings - Fork 528
Commit
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.
Signed-off-by: methylDragon <[email protected]>
- Loading branch information
1 parent
1e32c4b
commit 79b7f95
Showing
3 changed files
with
781 additions
and
0 deletions.
There are no files selected for viewing
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
268 changes: 268 additions & 0 deletions
268
...rajectory_cache/include/moveit/trajectory_cache/features/motion_plan_request_features.hpp
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,268 @@ | ||
// Copyright 2024 Intrinsic Innovation LLC. | ||
// | ||
// Licensed under the Apache License, Version 2.0 (the "License"); | ||
// you may not use this file except in compliance with the License. | ||
// You may obtain a copy of the License at | ||
// | ||
// http://www.apache.org/licenses/LICENSE-2.0 | ||
// | ||
// Unless required by applicable law or agreed to in writing, software | ||
// distributed under the License is distributed on an "AS IS" BASIS, | ||
// WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. | ||
// See the License for the specific language governing permissions and | ||
// limitations under the License. | ||
|
||
/** @file | ||
* @brief moveit_msgs::msg::MotionPlanRequest features to key the trajectory cache on. | ||
* @see FeaturesInterface<FeatureSourceT> | ||
* | ||
* @author methylDragon | ||
*/ | ||
|
||
#pragma once | ||
|
||
#include <warehouse_ros/message_collection.h> | ||
#include <moveit/move_group_interface/move_group_interface.h> | ||
|
||
#include <moveit/trajectory_cache/features/features_interface.hpp> | ||
|
||
namespace moveit_ros | ||
{ | ||
namespace trajectory_cache | ||
{ | ||
|
||
// "Start" features. =============================================================================== | ||
|
||
/** @class WorkspaceFeatures | ||
* @brief Extracts group name and details of the `workspace_parameters` field in the plan request. | ||
* | ||
* A cache hit with this feature is valid if the requested planning constraints has a workspace that | ||
* completely subsumes a cached entry's workspace. | ||
* | ||
* For example: (We ignore z for simplicity) | ||
* If workspace is defined by the extrema (x_min, y_min, x_max, y_max), | ||
* | ||
* Potential valid match if other constraints fulfilled: | ||
* Request: (-1, -1, 1, 1) | ||
* Plan in cache: (-0.5, -0.5, 0.5, 0.5) | ||
* | ||
* No match, since this plan might cause the end effector to go out of bounds.: | ||
* Request: (-1, -1, 1, 1) | ||
* Plan in cache: (-2, -0.5, 0.5, 0.5) | ||
*/ | ||
class WorkspaceFeatures : public FeaturesInterface<moveit_msgs::msg::MotionPlanRequest> | ||
{ | ||
public: | ||
WorkspaceFeatures(); | ||
|
||
std::string getName() const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsExactFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsInsertMetadata(warehouse_ros::Metadata& metadata, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group) const override; | ||
|
||
private: | ||
const std::string name_; | ||
}; | ||
|
||
/** @class StartStateJointStateFeatures | ||
* @brief Extracts details of the joint state from the `start_state` field in the plan request. | ||
* | ||
* The start state will always be re-interpreted into explicit joint state positions. | ||
* | ||
* WARNING: | ||
* MultiDOF joints and attached collision objects are not supported. | ||
*/ | ||
class StartStateJointStateFeatures : public FeaturesInterface<moveit_msgs::msg::MotionPlanRequest> | ||
{ | ||
public: | ||
StartStateJointStateFeatures(double match_tolerance); | ||
|
||
std::string getName() const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsExactFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsInsertMetadata(warehouse_ros::Metadata& metadata, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group) const override; | ||
|
||
private: | ||
rclcpp::Logger getLogger() const; | ||
|
||
moveit::core::MoveItErrorCode appendFeaturesAsFetchQueryWithTolerance( | ||
warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, double match_tolerance) const; | ||
|
||
const std::string name_; | ||
const double match_tolerance_; | ||
}; | ||
|
||
// "Goal" features. ================================================================================ | ||
|
||
/** @class MaxSpeedAndAccelerationFeatures | ||
* @brief Extracts max velocity and acceleration scaling, and cartesian speed limits from the plan request. | ||
*/ | ||
class MaxSpeedAndAccelerationFeatures : public FeaturesInterface<moveit_msgs::msg::MotionPlanRequest> | ||
{ | ||
public: | ||
MaxSpeedAndAccelerationFeatures(double match_tolerance); | ||
|
||
std::string getName() const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsExactFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsInsertMetadata(warehouse_ros::Metadata& metadata, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group) const override; | ||
|
||
private: | ||
moveit::core::MoveItErrorCode appendFeaturesAsFetchQueryWithTolerance( | ||
warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, double match_tolerance) const; | ||
|
||
const std::string name_; | ||
const double match_tolerance_; | ||
}; | ||
|
||
/** @class GoalConstraintsFeatures | ||
* @brief Extracts features fom the `goal_constraints` field in the plan request. | ||
* | ||
* @see appendConstraintsAsFetchQueryWithTolerance | ||
* @see appendConstraintsAsInsertMetadata | ||
*/ | ||
class GoalConstraintsFeatures : public FeaturesInterface<moveit_msgs::msg::MotionPlanRequest> | ||
{ | ||
public: | ||
GoalConstraintsFeatures(double match_tolerance); | ||
|
||
std::string getName() const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsExactFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsInsertMetadata(warehouse_ros::Metadata& metadata, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group) const override; | ||
|
||
private: | ||
rclcpp::Logger getLogger() const; | ||
|
||
moveit::core::MoveItErrorCode appendFeaturesAsFetchQueryWithTolerance( | ||
warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, double match_tolerance) const; | ||
|
||
const std::string name_; | ||
const double match_tolerance_; | ||
}; | ||
|
||
/** @class PathConstraintsFeatures | ||
* @brief Extracts features fom the `path_constraints` field in the plan request. | ||
* | ||
* @see appendConstraintsAsFetchQueryWithTolerance | ||
* @see appendConstraintsAsInsertMetadata | ||
*/ | ||
class PathConstraintsFeatures : public FeaturesInterface<moveit_msgs::msg::MotionPlanRequest> | ||
{ | ||
public: | ||
PathConstraintsFeatures(double match_tolerance); | ||
|
||
std::string getName() const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsExactFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsInsertMetadata(warehouse_ros::Metadata& metadata, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group) const override; | ||
|
||
private: | ||
rclcpp::Logger getLogger() const; | ||
|
||
moveit::core::MoveItErrorCode appendFeaturesAsFetchQueryWithTolerance( | ||
warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, double match_tolerance) const; | ||
|
||
const std::string name_; | ||
const double match_tolerance_; | ||
}; | ||
|
||
/** @class TrajectoryConstraintsFeatures | ||
* @brief Extracts features fom the `trajectory_constraints` field in the plan request. | ||
* | ||
* @see appendConstraintsAsFetchQueryWithTolerance | ||
* @see appendConstraintsAsInsertMetadata | ||
*/ | ||
class TrajectoryConstraintsFeatures : public FeaturesInterface<moveit_msgs::msg::MotionPlanRequest> | ||
{ | ||
public: | ||
TrajectoryConstraintsFeatures(double match_tolerance); | ||
|
||
std::string getName() const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsExactFetchQuery(warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, | ||
double exact_match_precision) const override; | ||
|
||
moveit::core::MoveItErrorCode | ||
appendFeaturesAsInsertMetadata(warehouse_ros::Metadata& metadata, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group) const override; | ||
|
||
private: | ||
rclcpp::Logger getLogger() const; | ||
|
||
moveit::core::MoveItErrorCode appendFeaturesAsFetchQueryWithTolerance( | ||
warehouse_ros::Query& query, const moveit_msgs::msg::MotionPlanRequest& source, | ||
const moveit::planning_interface::MoveGroupInterface& move_group, double match_tolerance) const; | ||
|
||
const std::string name_; | ||
const double match_tolerance_; | ||
}; | ||
|
||
} // namespace trajectory_cache | ||
} // namespace moveit_ros |
Oops, something went wrong.