Skip to content

Commit f07b81f

Browse files
committed
cleanup
1 parent 4781ed5 commit f07b81f

File tree

1 file changed

+2
-4
lines changed
  • core/include/moveit/task_constructor/stages

1 file changed

+2
-4
lines changed

core/include/moveit/task_constructor/stages/move_to.h

Lines changed: 2 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -66,10 +66,8 @@ class MoveTo : public PropagatingEitherWay
6666
void setIKFrame(const geometry_msgs::PoseStamped& pose) { setProperty("ik_frame", pose); }
6767
void setIKFrame(const Eigen::Isometry3d& pose, const std::string& link);
6868
template <typename T>
69-
void setIKFrame(const T& p, const std::string& link) {
70-
Eigen::Isometry3d pose;
71-
pose = p;
72-
setIKFrame(pose, link);
69+
void setIKFrame(const T& pose, const std::string& link) {
70+
setIKFrame(Eigen::Isometry3d(pose), link);
7371
}
7472
void setIKFrame(const std::string& link) { setIKFrame(Eigen::Isometry3d::Identity(), link); }
7573

0 commit comments

Comments
 (0)