@@ -98,11 +98,11 @@ namespace {
9898// ??? TODO: provide callback methods in PlanningScene class / probably not very useful here though...
9999// TODO: move into MoveIt core, lift active_components_only_ from fcl to common interface
100100bool isTargetPoseCollidingInEEF (const planning_scene::PlanningSceneConstPtr& scene,
101- robot_state ::RobotState& robot_state, Eigen::Isometry3d pose,
102- const robot_model:: LinkModel* link, const robot_model ::JointModelGroup* jmg = nullptr ,
101+ moveit::core ::RobotState& robot_state, Eigen::Isometry3d pose,
102+ const moveit::core:: LinkModel* link, const moveit::core ::JointModelGroup* jmg = nullptr ,
103103 collision_detection::CollisionResult* collision_result = nullptr ) {
104104 // consider all rigidly connected parent links as well
105- const robot_model:: LinkModel* parent = robot_model ::RobotModel::getRigidlyConnectedParentLinkModel (link);
105+ const moveit::core:: LinkModel* parent = moveit::core ::RobotModel::getRigidlyConnectedParentLinkModel (link);
106106 if (parent != link) // transform pose into pose suitable to place parent
107107 pose = pose * robot_state.getGlobalLinkTransform (link).inverse () * robot_state.getGlobalLinkTransform (parent);
108108
@@ -116,10 +116,10 @@ bool isTargetPoseCollidingInEEF(const planning_scene::PlanningSceneConstPtr& sce
116116 while (parent) {
117117 pending_links.push_back (&parent->getName ());
118118 link = parent;
119- const robot_model ::JointModel* joint = link->getParentJointModel ();
119+ const moveit::core ::JointModel* joint = link->getParentJointModel ();
120120 parent = joint->getParentLinkModel ();
121121
122- if (joint->getType () != robot_model ::JointModel::FIXED) {
122+ if (joint->getType () != moveit::core ::JointModel::FIXED) {
123123 for (const std::string* name : pending_links)
124124 acm.setDefaultEntry (*name, true );
125125 pending_links.clear ();
@@ -280,7 +280,7 @@ void ComputeIK::compute() {
280280 }
281281
282282 // determine IK link from ik_frame
283- const robot_model ::LinkModel* link = nullptr ;
283+ const moveit::core ::LinkModel* link = nullptr ;
284284 geometry_msgs::PoseStamped ik_pose_msg;
285285 const boost::any& value = props.get (" ik_frame" );
286286 if (value.empty ()) { // property undefined
@@ -311,7 +311,7 @@ void ComputeIK::compute() {
311311
312312 // validate placed link for collisions
313313 collision_detection::CollisionResult collisions;
314- robot_state ::RobotState sandbox_state{ scene->getCurrentState () };
314+ moveit::core ::RobotState sandbox_state{ scene->getCurrentState () };
315315 bool colliding =
316316 !ignore_collisions && isTargetPoseCollidingInEEF (scene, sandbox_state, target_pose, link, jmg, &collisions);
317317
@@ -349,7 +349,7 @@ void ComputeIK::compute() {
349349 std::vector<double > compare_pose;
350350 const std::string& compare_pose_name = props.get <std::string>(" default_pose" );
351351 if (!compare_pose_name.empty ()) {
352- robot_state ::RobotState compare_state (robot_model);
352+ moveit::core ::RobotState compare_state (robot_model);
353353 compare_state.setToDefaultValues (jmg, compare_pose_name);
354354 compare_state.copyJointGroupPositions (jmg, compare_pose);
355355 } else
@@ -359,7 +359,7 @@ void ComputeIK::compute() {
359359
360360 IKSolutions ik_solutions;
361361 auto is_valid = [scene, ignore_collisions, min_solution_distance,
362- &ik_solutions](robot_state:: RobotState* state, const robot_model ::JointModelGroup* jmg,
362+ &ik_solutions](moveit::core:: RobotState* state, const moveit::core ::JointModelGroup* jmg,
363363 const double * joint_positions) {
364364 for (const auto & sol : ik_solutions) {
365365 if (jmg->distance (joint_positions, sol.joint_positions .data ()) < min_solution_distance)
@@ -419,7 +419,7 @@ void ComputeIK::compute() {
419419 solution.markAsFailure (ss.str ());
420420 }
421421 // set scene's robot state
422- robot_state ::RobotState& solution_state = solution_scene->getCurrentStateNonConst ();
422+ moveit::core ::RobotState& solution_state = solution_scene->getCurrentStateNonConst ();
423423 solution_state.setJointGroupPositions (jmg, ik_solutions[i].joint_positions .data ());
424424 solution_state.update ();
425425
0 commit comments