moveit/moveit_msgs

remove GetKinematicSolverInfo.srv

isucan opened this issue · 5 comments

It is only used by pr2_arm_kinematics and nobody calls it. With the new plugin API for kinematics, this is not needed and causes confusion.

130s commented

Addressed for Kinetic in #35

130s commented

Addressed for Kinetic in #35

That's only for ROS Kinetic onward, so reopening.

No, I don't think we should backport a change like this to LTS indigo, or even jade. This issue has been addressed and can be closed.

we could not compile pr2_apps on kinetic due to this change, so how can we rewrite the code without using GetKinematicSolverInfo
see PR2/pr2_apps#35

v4hn commented

@k-okada The most convenient way to get the same list of joints is probably

moveit::planning_interface::MoveGroupInterface left("left_arm");
std::vector<std::string> joint_names= left.getActiveJoints();

Maybe you want to use getJointNames() instead.
I'm not sure whether the old service listed passive/mimic joints or not.
For the specific use-case on the PR2's arm groups this shouldn't matter though.