@@ -64,8 +64,6 @@ CartesIOServer::CartesIOServer(const ros::NodeHandle& node_handle, const ros::No
64
64
execute_all_poses_srv_ = nh_.advertiseService (" execute_all_poses" , &CartesIOServer::executeAllPosesSrvCb, this );
65
65
execute_all_locked_poses_srv_ =
66
66
nh_.advertiseService (" execute_all_locked_poses" , &CartesIOServer::executeAllLockedPosesSrvCb, this );
67
- // execute_mirrored_pose_srv_ =
68
- // nh_.advertiseService("execute_mirrored_pose", &CartesIOServer::executeMirroredPoseSrvCb, this);
69
67
}
70
68
71
69
auto CartesIOServer::executeAllPosesSrvCb (roport::ExecuteAllPoses::Request& req,
@@ -77,24 +75,12 @@ auto CartesIOServer::executeAllPosesSrvCb(roport::ExecuteAllPoses::Request& req,
77
75
for (int j = 0 ; j < req.group_names .size (); ++j) {
78
76
if (req.group_names [j] == group_names_[i]) {
79
77
geometry_msgs::Pose current_pose;
80
- if (!getPose (i, current_pose)) {
78
+ if (!getCurrentPoseWithIndex (i, current_pose)) {
81
79
return false ;
82
80
}
83
81
84
- // Initialize the goal pose
85
82
geometry_msgs::Pose goal_pose;
86
-
87
- // Transfer the given pose to the reference frame
88
- if (req.goal_type == req.GLOBAL ) {
89
- // The given pose is already in the reference frame
90
- goal_pose = req.goals .poses [j];
91
- } else if (req.goal_type == req.LOCAL_ALIGNED ) {
92
- // The given pose is relative to the local aligned frame having the same orientation as the reference frame
93
- localAlignedPoseToGlobalPose (req.goals .poses [j], current_pose, goal_pose, true );
94
- } else {
95
- // The given pose is relative to the local frame
96
- localPoseToGlobalPose (req.goals .poses [j], current_pose, goal_pose);
97
- }
83
+ toGlobalPose (req.goal_type , current_pose, req.goals .poses [j], goal_pose);
98
84
99
85
// Build trajectory to reach the goal
100
86
cartesian_interface::ReachPoseActionGoal action_goal;
@@ -130,26 +116,15 @@ auto CartesIOServer::executeAllLockedPosesSrvCb(roport::ExecuteAllLockedPoses::R
130
116
131
117
geometry_msgs::Pose goal_pose;
132
118
if (j == 0 ) {
133
- if (!getPose (i, current_reference_pose)) {
119
+ if (!getCurrentPoseWithIndex (i, current_reference_pose)) {
134
120
return false ;
135
121
}
136
122
reference_index = i;
137
-
138
- // Transfer the given pose to the reference frame
139
- if (req.goal_type == req.GLOBAL ) {
140
- // The given pose is already in the reference frame
141
- goal_pose = req.goal ;
142
- } else if (req.goal_type == req.LOCAL_ALIGNED ) {
143
- // The given pose is relative to the local aligned frame having the same orientation as the reference frame
144
- localAlignedPoseToGlobalPose (req.goal , current_reference_pose, goal_pose, true );
145
- } else {
146
- // The given pose is relative to the local frame
147
- localPoseToGlobalPose (req.goal , current_reference_pose, goal_pose);
148
- }
123
+ toGlobalPose (req.goal_type , current_reference_pose, req.goal , goal_pose);
149
124
goal_reference_pose = goal_pose;
150
125
} else {
151
126
geometry_msgs::Pose current_pose;
152
- if (!getPose (i, current_pose)) {
127
+ if (!getCurrentPoseWithIndex (i, current_pose)) {
153
128
return false ;
154
129
}
155
130
getGoalPoseWithReference (reference_index, current_reference_pose, goal_reference_pose, i, current_pose,
@@ -183,7 +158,7 @@ bool CartesIOServer::getTransform(const int& index, geometry_msgs::TransformStam
183
158
}
184
159
}
185
160
186
- bool CartesIOServer::getPose (const int & index, geometry_msgs::Pose& pose) {
161
+ bool CartesIOServer::getCurrentPoseWithIndex (const int & index, geometry_msgs::Pose& pose) {
187
162
geometry_msgs::TransformStamped transform;
188
163
if (!getTransform (index , transform)) {
189
164
return false ;
@@ -217,91 +192,6 @@ void CartesIOServer::getGoalPoseWithReference(const int& ref_idx,
217
192
eigenMatrixToGeometryPose (trans_b_g, goal_pose);
218
193
}
219
194
220
- // auto CartesIOServer::executeMirroredPoseSrvCb(roport::ExecuteMirroredPose::Request& req,
221
- // roport::ExecuteMirroredPose::Response& resp) -> bool {
222
- // int ref_index = getGroupIndex(req.reference_group);
223
- // if (ref_index < 0) {
224
- // throw std::runtime_error("Reference group does not exist");
225
- // }
226
- // int mirror_index = getGroupIndex(req.mirror_group);
227
- // if (mirror_index < 0) {
228
- // throw std::runtime_error("Mirror group does not exist");
229
- // }
230
- //
231
- // std::map<int, trajectory_msgs::JointTrajectory> trajectories;
232
- // trajectory_msgs::JointTrajectory trajectory;
233
- // geometry_msgs::PoseStamped current_pose_wrt_base = interfaces_[ref_index]->getCurrentPose();
234
- // geometry_msgs::PoseStamped goal_pose_wrt_base;
235
- // goal_pose_wrt_base.header = current_pose_wrt_base.header;
236
- //
237
- // // Transfer given goal pose to the base frame
238
- // if (req.goal_type == req.BASE_ABS) {
239
- // goal_pose_wrt_base.pose = req.goal;
240
- // } else if (req.goal_type == req.BASE_REL) {
241
- // geometry_msgs::PoseStamped transform_wrt_local_base;
242
- // transform_wrt_local_base.pose = req.goal;
243
- // relativePoseToAbsolutePose(transform_wrt_local_base, current_pose_wrt_base, goal_pose_wrt_base);
244
- // } else {
245
- // geometry_msgs::PoseStamped goal_pose_wrt_eef;
246
- // goal_pose_wrt_eef.pose = req.goal;
247
- // goal_pose_wrt_eef.header.frame_id = interfaces_[ref_index]->getEndEffectorLink();
248
- // goal_pose_wrt_base =
249
- // tf_buffer_.transform(goal_pose_wrt_eef, interfaces_[ref_index]->getPlanningFrame(), ros::Duration(1));
250
- // }
251
- //
252
- // // Build trajectory to reach the goal
253
- // if (!buildTrajectory(*interfaces_[ref_index], goal_pose_wrt_base, trajectory, req.is_cartesian)) {
254
- // ROS_ERROR("RoPort: Building trajectory failed");
255
- // resp.result_status = resp.FAILED;
256
- // return true;
257
- // }
258
- //
259
- // trajectory_msgs::JointTrajectory updated_trajectory;
260
- // if (req.stamp > 0) {
261
- // updateTrajectoryStamp(trajectory, req.stamp, updated_trajectory);
262
- // } else {
263
- // updated_trajectory = trajectory;
264
- // }
265
- // trajectories.insert({ref_index, updated_trajectory});
266
- //
267
- // trajectory_msgs::JointTrajectory mirrored_trajectory;
268
- // getMirroredTrajectory(*interfaces_[mirror_index], updated_trajectory, req.mirror_vector, mirrored_trajectory);
269
- // trajectories.insert({mirror_index, mirrored_trajectory});
270
- //
271
- // if (executeTrajectories(trajectories)) {
272
- // resp.result_status = resp.SUCCEEDED;
273
- // } else {
274
- // resp.result_status = resp.FAILED;
275
- // }
276
- // return true;
277
- // }
278
- //
279
- // void CartesIOServer::getMirroredTrajectory(MoveGroupInterface& move_group,
280
- // trajectory_msgs::JointTrajectory trajectory,
281
- // std::vector<double> mirror_vector,
282
- // trajectory_msgs::JointTrajectory& mirrored_trajectory) {
283
- // mirrored_trajectory.joint_names = move_group.getActiveJoints();
284
- // mirrored_trajectory.header = trajectory.header;
285
- // for (size_t i = 0; i < trajectory.points.size(); ++i) {
286
- // trajectory_msgs::JointTrajectoryPoint p;
287
- // p = trajectory.points[i];
288
- // ROS_ASSERT(p.positions.size() == mirror_vector.size());
289
- // for (size_t j = 0; j < p.positions.size(); ++j) {
290
- // p.positions[j] *= mirror_vector[j];
291
- // if (!p.velocities.empty()) {
292
- // p.velocities[j] *= mirror_vector[j];
293
- // }
294
- // if (!p.accelerations.empty()) {
295
- // p.accelerations[j] *= mirror_vector[j];
296
- // }
297
- // if (!p.effort.empty()) {
298
- // p.effort[j] *= mirror_vector[j];
299
- // }
300
- // }
301
- // mirrored_trajectory.points.push_back(p);
302
- // }
303
- // }
304
-
305
195
void CartesIOServer::buildActionGoal (const int & index,
306
196
const geometry_msgs::Pose& goal_pose,
307
197
cartesian_interface::ReachPoseActionGoal& action_goal) {
0 commit comments