Hi Sanja,<br><br>I haven't used <a href="http://www.ros.org/wiki/hrl_tilting_hokuyo">hrl_tilting_hokuyo</a>, so maybe some Georgia Tech folks can chime in about that.<br><br>I would suggest using the <a href="http://www.ros.org/wiki/laser_assembler">laser_assembler</a> package.  This will expose a service call that provides point clouds, given a time interval on which you want to assemble laser scans.<br>

<br>Are you adding this to an existing robot running ROS, or are you starting from scratch?  If starting from scratch, there are a couple steps you'll need to take.  First, to interface with the Hokuyo hardware and publish laser scans, you can use <a href="http://www.ros.org/wiki/hokuyo_node">hokuyo_node</a>.  The laser_assembler also needs TF data for the frame of the laser.  The suggested way to do this is by writing a <a href="http://www.ros.org/wiki/urdf">URDF</a> description of your robot, and then use the <a href="http://www.ros.org/wiki/robot_state_publisher">robot_state_publisher</a> to publish the transforms.<br>

<br>You'll also need to write a hardware specific node to control the servo system.  This control node should publish <a href="http://www.ros.org/wiki/sensor_msgs">sensor_msgs/JointState</a>, since this is required by the robot_state_publisher to generate the transforms.  Since the controller would also know the current angle of the tilting platform, it can decide when each tilting cycle is complete and then make the appropriate service call to the laser_assembler to get a point cloud.<br>

<br>Hopefully this makes sense.  Let me know if you run into trouble.<br><br>Vijay<br><br><div class="gmail_quote">On Fri, Jul 2, 2010 at 10:47 AM, Sanja Popovic <span dir="ltr"><<a href="mailto:sanja@mit.edu">sanja@mit.edu</a>></span> wrote:<br>

<blockquote class="gmail_quote" style="border-left: 1px solid rgb(204, 204, 204); margin: 0pt 0pt 0pt 0.8ex; padding-left: 1ex;">Hi,<br>
<br>
I have a Hokuyo URG-04LX and I would like to mount it to a tilt head to get a point cloud. The tilt head I have is a ServoCity DDT500 (<a href="http://www.servocity.com/html/ddt500_direct_drive_tilt.html" target="_blank">http://www.servocity.com/html/ddt500_direct_drive_tilt.html</a>) and I also use their servo (<a href="http://www.servocity.com/html/servo_controllers.html" target="_blank">http://www.servocity.com/html/servo_controllers.html</a>). Is it possible to use those with ROS with some of the existing packages like hrl_tilting_hokuyo? If not, do you suggest rewriting a package (which one?) or just getting a new head + servo?<br>


<br>
Thanks,<br>
<font color="#888888">Sanja Popovic<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>
</font></blockquote></div><br>