Is the mapping_msgs/CollisionObject being deprecated for inserting objects into the collision environment? I couldn't find anything on the wiki.<br><br>Kevin<br><br><div class="gmail_quote">On Tue, Nov 23, 2010 at 9:15 AM, Matei Ciocarlie <span dir="ltr"><<a href="mailto:matei@willowgarage.com">matei@willowgarage.com</a>></span> wrote:<br>
<blockquote class="gmail_quote" style="margin: 0pt 0pt 0pt 0.8ex; border-left: 1px solid rgb(204, 204, 204); padding-left: 1ex;">Hi Severin,<br><br>We have something like that in our object_manipulation stack, which has the need to reason about objects from a database of known household objects. For that we use the following message:<br>
<br>household_objects_database_msgs/DatabaseModelPose<br>
<br># Informs that a specific model from the Model Database has been <br># identified at a certain location<br><br># the database id of the model<br>int32 model_id<br># the pose that it can be found in<br>geometry_msgs/PoseStamped pose<br>

<br>This looks like what you need, even though your objects are not (yet) in the database itself. However, it is simple enough that you don't necessarily have to use it if you don't want to bring in the additional dependencies.<br>

<br>The CollisionObject messages are used to let the Collision Environment know about objects in the world. Note that this is a separate task from any other code you might have that uses object info. It is very useful though: you can assign your object a unique collision name, and then refer to it to individually enable/disable collision checking for your object, etc. More details at:<br>

<br><a href="http://www.ros.org/wiki/motion_planning_environment/Tutorials/Adding%20known%20objects%20to%20the%20collision%20environment" target="_blank">http://www.ros.org/wiki/motion_planning_environment/Tutorials/Adding%20known%20objects%20to%20the%20collision%20environment</a><br>

<br>Let us know if we can help further.<br><br>Best,<br>Matei<div><div></div><div class="h5"><br><br><div class="gmail_quote">On Tue, Nov 23, 2010 at 12:32 AM, Severin Lemaignan <span dir="ltr"><<a href="mailto:lemaigna@in.tum.de" target="_blank">lemaigna@in.tum.de</a>></span> wrote:<br>

<blockquote class="gmail_quote" style="margin: 0pt 0pt 0pt 0.8ex; border-left: 1px solid rgb(204, 204, 204); padding-left: 1ex;">Hello,<br>
<br>
I need to represent a set of high-level objects by their id and pose in<br>
the environment.<br>
<br>
The best message candidate seems to be so far the<br>
mapping_msgs/CollisionObject type, but I read on the wiki that it is<br>
soon to be deprecated.<br>
<br>
Is it still recommended to use it or is an alternative available?<br>
<br>
Cheers,<br>
Severin<br>
<br>
--<br>
          Séverin Lemaignan - <a href="mailto:lemaigna@in.tum.de" target="_blank">lemaigna@in.tum.de</a><br>
  [00]    PhD student on Cognitive Robotics<br>
/|__|\   Technische Uni München - IAS group / LAAS-CNRS - RIS group<br>
   ''     +498928917780 / +33561337844<br>
          <a href="http://www.laas.fr/%7Eslemaign" target="_blank">http://www.laas.fr/~slemaign</a><br>
_______________________________________________<br>
ros-users mailing list<br>
<a href="mailto:ros-users@code.ros.org" target="_blank">ros-users@code.ros.org</a><br>
<a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
</blockquote></div><br><br clear="all"><br></div></div><font color="#888888">-- <br>Matei Ciocarlie<br>Research Scientist<br>Willow Garage Inc.<br>650-475-9780<br>
</font><br>_______________________________________________<br>
ros-users mailing list<br>
<a href="mailto:ros-users@code.ros.org">ros-users@code.ros.org</a><br>
<a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
<br></blockquote></div><br>