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

Revision history [back]

Hi there, I was having the same problem, and changing the intensities to ranges it worked, try this:

#include "ros/ros.h"
#include "std_msgs/String.h"
#include "sensor_msgs/LaserScan.h"

void scanValues(const sensor_msgs::LaserScan laser)
{
    fprintf(stderr,"\n -------- size[%d] ---------- ", laser.ranges.size());
    for (unsigned int i=0; i<laser.ranges.size();i++)
    {
        fprintf(stderr,"range[%d]=[%f]: ", i, laser.ranges[i]);

    }
}

int main(int argc, char **argv)
{
  ros::init(argc, argv, "hLaserReader");
  ros::NodeHandle n;
  ros::Subscriber hokuyoSubscriber = n.subscribe("/scan", 1, scanValues);
  ros::spin();
  return 0;
}here

Hi there, I was having the same problem, and changing the intensities to ranges it worked, try this:

#include "ros/ros.h"
#include "std_msgs/String.h"
#include "sensor_msgs/LaserScan.h"

void scanValues(const sensor_msgs::LaserScan laser)
{
    fprintf(stderr,"\n -------- size[%d] ---------- ", laser.ranges.size());
    for (unsigned int i=0; i<laser.ranges.size();i++)
    {
        fprintf(stderr,"range[%d]=[%f]: ", i, laser.ranges[i]);

    }
}

int main(int argc, char **argv)
{
  ros::init(argc, argv, "hLaserReader");
  ros::NodeHandle n;
  ros::Subscriber hokuyoSubscriber = n.subscribe("/scan", 1, scanValues);
  ros::spin();
  return 0;
}here
}