expose timeout property as typed setter

This commit is contained in:
v4hn 2018-02-26 14:14:09 +01:00 committed by Robert Haschke
parent 8af44cefc3
commit 80ae01dcca

View File

@ -49,6 +49,10 @@ class Connect : public Connecting {
public:
Connect(std::string name, const solvers::PlannerInterfacePtr &planner);
void setTimeout(const ros::Duration& timeout){
setProperty("timeout", timeout.toSec());
}
void setPathConstraints(moveit_msgs::Constraints path_constraints){
setProperty("path_constraints", std::move(path_constraints));
}