ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

pointcloud_to_laserscan package not working in ROS indigo

asked 2015-02-01 15:03:42 -0500

gaussian gravatar image

updated 2015-02-06 17:55:58 -0500

The pointcloud_to_laserscan package is not working properly in ROS Indigo. The Indigo build is done recently and seems to contain some error. As required by the node I have published the pointcloud data from Kinect in PointCloud2 format in /cloud_in topic. But the laserscan data that must be produced and published by Kinect in /scan topic seems erroneous. It returns an array full of 'Inf'. Please fix the error.

My code for publishing in /cloud_in is as follows,

#!/usr/bin/env python
import roslib
import rospy
import geometry_msgs.msg
from sensor_msgs.msg import PointCloud2

def callback(data):
    pub = rospy.Publisher('/cloud_in', PointCloud2,queue_size=10)
    pub.publish(data)

def pcl_2D():
    rospy.init_node('pcl_2D', anonymous=True)
    global listener 
    rospy.Subscriber("/camera/depth/points", PointCloud2, callback)
    rospy.spin()

if __name__=='__main__':
    pcl_2D()

I have attached the rosbag which contains the data in topics /cloud_in /rosout and erroneous /scan. Each topics have 10 msgs published. I have compressed the bag using rosbag compress . Please use rosbag decompress 2015-02-07-02-09-32.bag before starting analyse.

Attachment link: https://drive.google.com/file/d/0B7uP...

Thanks in advance :)

edit retag flag offensive close merge delete

Comments

You don't provide enough information to reproduce this problem; which makes it impossible to fix. At the very least, please provide the parameters that you're using for the pointcloud to lasterscan node, and a bag file of the pointcloud and tf data that you're feeding into it.

ahendrix gravatar image ahendrix  ( 2015-02-01 16:39:20 -0500 )edit

Posting the same question on ROS Answers and as a bug is considered poor etiquette. If you have a question, please ask it on ROS answers, and only report it as a bug if the answers suggest that it is actually a bug.

ahendrix gravatar image ahendrix  ( 2015-02-07 02:23:38 -0500 )edit

ya okay @ahendrix

gaussian gravatar image gaussian  ( 2015-02-07 04:52:36 -0500 )edit

1 Answer

Sort by ยป oldest newest most voted
0

answered 2015-02-06 18:41:33 -0500

paulbovbel gravatar image
edit flag offensive delete link more

Question Tools

1 follower

Stats

Asked: 2015-02-01 15:03:42 -0500

Seen: 403 times

Last updated: Feb 06 '15