Skip to content

Commit c5c260d

Browse files
committed
refine and clean
1 parent c0e8e09 commit c5c260d

File tree

4 files changed

+37
-133
lines changed

4 files changed

+37
-133
lines changed

include/roport/cartesio_server.h

+8-12
Original file line numberDiff line numberDiff line change
@@ -66,7 +66,6 @@ class CartesIOServer {
6666

6767
ros::ServiceServer execute_all_poses_srv_;
6868
ros::ServiceServer execute_all_locked_poses_srv_;
69-
ros::ServiceServer execute_mirrored_pose_srv_;
7069

7170
using reachPoseActionClient = actionlib::SimpleActionClient<cartesian_interface::ReachPoseAction>;
7271
std::vector<std::shared_ptr<reachPoseActionClient>> control_clients_;
@@ -90,11 +89,6 @@ class CartesIOServer {
9089
auto executeAllLockedPosesSrvCb(roport::ExecuteAllLockedPoses::Request& req,
9190
roport::ExecuteAllLockedPoses::Response& resp) -> bool;
9291

93-
// auto executeMirroredPoseSrvCb(roport::ExecuteMirroredPose::Request& req, roport::ExecuteMirroredPose::Response&
94-
// resp)
95-
// -> bool;
96-
//
97-
9892
void buildActionGoal(const int& index,
9993
const geometry_msgs::Pose& goal_pose,
10094
cartesian_interface::ReachPoseActionGoal& action_goal);
@@ -104,14 +98,16 @@ class CartesIOServer {
10498
auto executeGoals(const std::map<int, cartesian_interface::ReachPoseActionGoal>& goals, double duration = 120)
10599
-> bool;
106100

107-
// static void getMirroredTrajectory(MoveGroupInterface& move_group,
108-
// trajectory_msgs::JointTrajectory trajectory,
109-
// std::vector<double> mirror_vector,
110-
// trajectory_msgs::JointTrajectory& mirrored_trajectory);
111-
112101
bool getTransform(const int& index, geometry_msgs::TransformStamped& transform);
113102

114-
bool getPose(const int& index, geometry_msgs::Pose& pose);
103+
/**
104+
* Given the index of the group in group_names_, get current pose of that group's control frame wrt the reference
105+
* frame.
106+
* @param index Group index in group_names_.
107+
* @param pose Pose of the control frame.
108+
* @return True if succeed, false otherwise.
109+
*/
110+
bool getCurrentPoseWithIndex(const int& index, geometry_msgs::Pose& pose);
115111

116112
void getGoalPoseWithReference(const int& ref_idx,
117113
const geometry_msgs::Pose& curr_ref_pose,

include/roport/common.h

+18
Original file line numberDiff line numberDiff line change
@@ -144,6 +144,24 @@ inline void localAlignedPoseToGlobalPose(const geometry_msgs::Pose& pose_local_a
144144
eigenMatrixToGeometryPose(mat_global_to_target, pose_global_to_target);
145145
}
146146

147+
inline void toGlobalPose(const int& goal_type,
148+
const geometry_msgs::Pose& current_pose,
149+
const geometry_msgs::Pose& cmd_pose,
150+
geometry_msgs::Pose& goal_pose) {
151+
if (goal_type == 0) {
152+
// The given pose is already in the reference frame
153+
goal_pose = cmd_pose;
154+
} else if (goal_type == 1) {
155+
// The given pose is relative to the local aligned frame having the same orientation as the reference frame
156+
localAlignedPoseToGlobalPose(cmd_pose, current_pose, goal_pose, true);
157+
} else if (goal_type == 2) {
158+
// The given pose is relative to the local frame
159+
localPoseToGlobalPose(cmd_pose, current_pose, goal_pose);
160+
} else {
161+
throw std::invalid_argument("Goal type not supported");
162+
}
163+
}
164+
147165
inline auto isPoseLegal(const geometry_msgs::Pose& pose) -> bool {
148166
if (pose.orientation.w == 0 && pose.orientation.x == 0 && pose.orientation.y == 0 && pose.orientation.z == 0) {
149167
ROS_ERROR("The pose is empty (all orientation coefficients are zero)");

src/lib/cartesio_server.cpp

+6-116
Original file line numberDiff line numberDiff line change
@@ -64,8 +64,6 @@ CartesIOServer::CartesIOServer(const ros::NodeHandle& node_handle, const ros::No
6464
execute_all_poses_srv_ = nh_.advertiseService("execute_all_poses", &CartesIOServer::executeAllPosesSrvCb, this);
6565
execute_all_locked_poses_srv_ =
6666
nh_.advertiseService("execute_all_locked_poses", &CartesIOServer::executeAllLockedPosesSrvCb, this);
67-
// execute_mirrored_pose_srv_ =
68-
// nh_.advertiseService("execute_mirrored_pose", &CartesIOServer::executeMirroredPoseSrvCb, this);
6967
}
7068

7169
auto CartesIOServer::executeAllPosesSrvCb(roport::ExecuteAllPoses::Request& req,
@@ -77,24 +75,12 @@ auto CartesIOServer::executeAllPosesSrvCb(roport::ExecuteAllPoses::Request& req,
7775
for (int j = 0; j < req.group_names.size(); ++j) {
7876
if (req.group_names[j] == group_names_[i]) {
7977
geometry_msgs::Pose current_pose;
80-
if (!getPose(i, current_pose)) {
78+
if (!getCurrentPoseWithIndex(i, current_pose)) {
8179
return false;
8280
}
8381

84-
// Initialize the goal pose
8582
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);
9884

9985
// Build trajectory to reach the goal
10086
cartesian_interface::ReachPoseActionGoal action_goal;
@@ -130,26 +116,15 @@ auto CartesIOServer::executeAllLockedPosesSrvCb(roport::ExecuteAllLockedPoses::R
130116

131117
geometry_msgs::Pose goal_pose;
132118
if (j == 0) {
133-
if (!getPose(i, current_reference_pose)) {
119+
if (!getCurrentPoseWithIndex(i, current_reference_pose)) {
134120
return false;
135121
}
136122
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);
149124
goal_reference_pose = goal_pose;
150125
} else {
151126
geometry_msgs::Pose current_pose;
152-
if (!getPose(i, current_pose)) {
127+
if (!getCurrentPoseWithIndex(i, current_pose)) {
153128
return false;
154129
}
155130
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
183158
}
184159
}
185160

186-
bool CartesIOServer::getPose(const int& index, geometry_msgs::Pose& pose) {
161+
bool CartesIOServer::getCurrentPoseWithIndex(const int& index, geometry_msgs::Pose& pose) {
187162
geometry_msgs::TransformStamped transform;
188163
if (!getTransform(index, transform)) {
189164
return false;
@@ -217,91 +192,6 @@ void CartesIOServer::getGoalPoseWithReference(const int& ref_idx,
217192
eigenMatrixToGeometryPose(trans_b_g, goal_pose);
218193
}
219194

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-
305195
void CartesIOServer::buildActionGoal(const int& index,
306196
const geometry_msgs::Pose& goal_pose,
307197
cartesian_interface::ReachPoseActionGoal& action_goal) {

srv/ExecuteAllLockedPoses.srv

+5-5
Original file line numberDiff line numberDiff line change
@@ -1,13 +1,13 @@
1-
# Move multiple groups to the target poses. One group will be used as the reference, whose goal pose is given,
1+
# Move multiple groups to the target poses. The first group will be used as the reference, whose goal pose is given,
22
# other groups will move according to the reference and kept the relative pose along movement.
33

44
# Requests
55
# group_names: Names of the moving groups.
6-
# goal_type: GLOBAL: Absolute pose wrt the base frame (robot base).
7-
# LOCAL_ALIGNED: Relative pose wrt the base frame transferred to current eef base position.
6+
# goal_type: GLOBAL: Absolute pose wrt the reference frame (usually the robot base frame).
7+
# LOCAL_ALIGNED: Relative pose wrt the reference frame transferred to current eef base position.
88
# LOCAL: pose wrt the eef frame.
9-
# goal: Goal pose for the reference group (the first group in the group_names).
10-
# stamp: Time interval for reaching goals.
9+
# goal: Goal pose for the reference group (the first group in group_names).
10+
# stamp: Time interval for all groups reaching goals.
1111

1212
std_msgs/Header header
1313
string[] group_names

0 commit comments

Comments
 (0)