Skip to content

Commit

Permalink
got rid of some output statements for now
Browse files Browse the repository at this point in the history
  • Loading branch information
cpaxton committed Aug 11, 2014
1 parent 6aae715 commit 8dba464
Showing 1 changed file with 9 additions and 9 deletions.
18 changes: 9 additions & 9 deletions gazebo_plugins/src/gazebo_ros_moveit_planning_scene.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -217,10 +217,10 @@ void GazeboRosMoveItPlanningScene::UpdateCB()
// Create a new collision object representing this gazebo model if it's not in the map
if(found_collision_object == collision_object_map_.end() || publish_full_scene_){

ROS_INFO("Creating collision object model %s, this=%s, objects=%u",
model_name.c_str(),
model_name_.c_str(),
(unsigned int)collision_object_map_.size());
//ROS_INFO("Creating collision object model %s, this=%s, objects=%u",
// model_name.c_str(),
// model_name_.c_str(),
// (unsigned int)collision_object_map_.size());

moveit_msgs::CollisionObject new_object;
new_object.id = model_name;
Expand Down Expand Up @@ -486,11 +486,11 @@ void GazeboRosMoveItPlanningScene::UpdateCB()

object.primitives.push_back(primitive_msg);
}
ROS_INFO("model %s has %u links",model_name.c_str(),links.size());
ROS_INFO("model %s has %u meshes, %u mesh poses",
model_name.c_str(),
(unsigned int)object.meshes.size(),
(unsigned int)object.mesh_poses.size());
//ROS_INFO("model %s has %u links",model_name.c_str(),links.size());
//ROS_INFO("model %s has %u meshes, %u mesh poses",
// model_name.c_str(),
// (unsigned int)object.meshes.size(),
// (unsigned int)object.mesh_poses.size());
}
}
}
Expand Down

0 comments on commit 8dba464

Please sign in to comment.