File tree Expand file tree Collapse file tree 2 files changed +3
-3
lines changed
include/moveit/task_constructor Expand file tree Collapse file tree 2 files changed +3
-3
lines changed Original file line number Diff line number Diff line change @@ -73,7 +73,7 @@ class Task : protected WrapperBase
7373public:
7474 PRIVATE_CLASS (Task)
7575
76- // +1 TODO: move into MoveIt! core
76+ // +1 TODO: move into MoveIt core
7777 static planning_pipeline::PlanningPipelinePtr
7878 createPlanner (const moveit::core::RobotModelConstPtr& model, const std::string& ns = " move_group" ,
7979 const std::string& planning_plugin_param_name = " planning_plugin" ,
Original file line number Diff line number Diff line change @@ -88,7 +88,7 @@ using IKSolutions = std::vector<std::vector<double>>;
8888namespace {
8989
9090// ??? TODO: provide callback methods in PlanningScene class / probably not very useful here though...
91- // TODO: move into MoveIt! core, lift active_components_only_ from fcl to common interface
91+ // TODO: move into MoveIt core, lift active_components_only_ from fcl to common interface
9292bool isTargetPoseColliding (const planning_scene::PlanningScenePtr& scene, Eigen::Isometry3d pose,
9393 const robot_model::LinkModel* link,
9494 collision_detection::CollisionResult* collision_result = nullptr ) {
@@ -277,7 +277,7 @@ void ComputeIK::compute() {
277277 if (value.empty ()) { // property undefined
278278 // determine IK link from eef/group
279279 if (!(link = eef_jmg ? robot_model->getLinkModel (eef_jmg->getEndEffectorParentGroup ().second ) :
280- jmg->getOnlyOneEndEffectorTip ())) {
280+ jmg->getOnlyOneEndEffectorTip ())) {
281281 ROS_WARN_STREAM_NAMED (" ComputeIK" , " Failed to derive IK target link" );
282282 return ;
283283 }
You can’t perform that action at this time.
0 commit comments