34namespace trajectory_cache
42template <
typename AppendT,
typename FeatureSourceT>
52 return "QueryOnlyEqFeature." + name_;
58 double exact_match_precision)
const override
66 double )
const override
68 query.append(name_, value_);
69 return moveit::core::MoveItErrorCode::SUCCESS;
76 return moveit::core::MoveItErrorCode::SUCCESS;
87template <
typename AppendT,
typename FeatureSourceT>
97 return "QueryOnlyLTEFeature." + name_;
103 double exact_match_precision)
const override
111 double )
const override
113 query.appendLTE(name_, value_);
114 return moveit::core::MoveItErrorCode::SUCCESS;
121 return moveit::core::MoveItErrorCode::SUCCESS;
132template <
typename AppendT,
typename FeatureSourceT>
142 return "QueryOnlyGTEFeature." + name_;
148 double exact_match_precision)
const override
156 double )
const override
158 query.appendGTE(name_, value_);
159 return moveit::core::MoveItErrorCode::SUCCESS;
166 return moveit::core::MoveItErrorCode::SUCCESS;
177template <
typename AppendT,
typename FeatureSourceT>
182 : name_(std::move(name)), lower_(lower), upper_(upper)
188 return "QueryOnlyRangeInclusiveWithToleranceFeature." + name_;
194 double exact_match_precision)
const override
202 double )
const override
204 query.appendRangeInclusive(name_, lower_, upper_);
205 return moveit::core::MoveItErrorCode::SUCCESS;
212 return moveit::core::MoveItErrorCode::SUCCESS;
226template <
typename AppendT,
typename FeatureSourceT>
236 return "MetadataOnlyFeature." + name_;
242 double )
const override
244 return moveit::core::MoveItErrorCode::SUCCESS;
250 double )
const override
252 return moveit::core::MoveItErrorCode::SUCCESS;
259 metadata.append(name_, value_);
260 return moveit::core::MoveItErrorCode::SUCCESS;
a wrapper around moveit_msgs::MoveItErrorCodes to make it easier to return an error code message from...
Client class to conveniently use the ROS interfaces provided by the move_group node.
QueryOnlyEqFeature(std::string name, AppendT value)
moveit::core::MoveItErrorCode appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &source, const moveit::planning_interface::MoveGroupInterface &move_group, double exact_match_precision) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with fuzzy matching.
moveit::core::MoveItErrorCode appendFeaturesAsInsertMetadata(warehouse_ros::Metadata &, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &) const override
Extracts relevant features from FeatureSourceT, to be appended to a cache entry's metadata.
moveit::core::MoveItErrorCode appendFeaturesAsExactFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &, double) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with exact matching.
std::string getName() const override
Gets the name of the features implementation.
moveit::core::MoveItErrorCode appendFeaturesAsExactFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &, double) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with exact matching.
moveit::core::MoveItErrorCode appendFeaturesAsInsertMetadata(warehouse_ros::Metadata &, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &) const override
Extracts relevant features from FeatureSourceT, to be appended to a cache entry's metadata.
QueryOnlyGTEFeature(std::string name, AppendT value)
std::string getName() const override
Gets the name of the features implementation.
moveit::core::MoveItErrorCode appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &source, const moveit::planning_interface::MoveGroupInterface &move_group, double exact_match_precision) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with fuzzy matching.
moveit::core::MoveItErrorCode appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &source, const moveit::planning_interface::MoveGroupInterface &move_group, double exact_match_precision) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with fuzzy matching.
std::string getName() const override
Gets the name of the features implementation.
QueryOnlyLTEFeature(std::string name, AppendT value)
moveit::core::MoveItErrorCode appendFeaturesAsExactFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &, double) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with exact matching.
moveit::core::MoveItErrorCode appendFeaturesAsInsertMetadata(warehouse_ros::Metadata &, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &) const override
Extracts relevant features from FeatureSourceT, to be appended to a cache entry's metadata.
QueryOnlyRangeInclusiveWithToleranceFeature(std::string name, AppendT lower, AppendT upper)
moveit::core::MoveItErrorCode appendFeaturesAsExactFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &, double) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with exact matching.
moveit::core::MoveItErrorCode appendFeaturesAsInsertMetadata(warehouse_ros::Metadata &, const FeatureSourceT &, const moveit::planning_interface::MoveGroupInterface &) const override
Extracts relevant features from FeatureSourceT, to be appended to a cache entry's metadata.
moveit::core::MoveItErrorCode appendFeaturesAsFuzzyFetchQuery(warehouse_ros::Query &query, const FeatureSourceT &source, const moveit::planning_interface::MoveGroupInterface &move_group, double exact_match_precision) const override
Extracts relevant features from FeatureSourceT, to be appended to a fetch query, with fuzzy matching.
std::string getName() const override
Gets the name of the features implementation.
Abstract template class for extracting features from some FeatureSourceT.