ringcomp_nodelet.cc File Reference

#include <cmath>
#include <ros/ros.h>
#include <pluginlib/class_list_macros.h>
#include "Poco/Foundation.h"
#include <string>
#include <stdexcept>
#include "Poco/Exception.h"
#include <pthread.h>
#include <errno.h>
#include <set>
#include <map>
#include <typeinfo>
#include "exception.h"
#include <vector>
#include <ros/console.h>
#include <boost/shared_ptr.hpp>
#include <boost/scoped_ptr.hpp>
#include <boost/thread/mutex.hpp>
#include <boost/thread/condition.hpp>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "std_msgs/Header.h"
#include <iostream.h>
#include <stdio.h>
#include <cstring>
#include <geometry_msgs/Point32.h>
#include <sensor_msgs/PointCloud.h>
Include dependency graph for ringcomp_nodelet.cc:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  ringcomp_nodelet::RingCompNodelet::Config
 configuration parameters More...
class  ringcomp_nodelet::RingCompNodelet

Namespaces

namespace  ringcomp_nodelet

Functions

 ringcomp_nodelet::PLUGINLIB_DECLARE_CLASS (velodyne_ringcomp, RingCompNodelet, ringcomp_nodelet::RingCompNodelet, nodelet::Nodelet)

Variables

int ringcomp_nodelet::CASE_1_LIM
float ringcomp_nodelet::CASE_1_RANGES [velodyne::N_LASERS]
int ringcomp_nodelet::CASE_3_LIM = 58
float ringcomp_nodelet::COMP_BASE [velodyne::N_LASERS-1]
const float ringcomp_nodelet::FLAT_COMP [velodyne::N_LASERS-1]
const float ringcomp_nodelet::LAZ_ANG [velodyne::N_LASERS]
const int ringcomp_nodelet::N_ANGLES = 360
 number of angles in ring matrix

Detailed Description

This ROS nodelet processes raw Velodyne HDL-64E 3D LIDAR data to detect obstacles using ring compression.

Definition in file ringcomp_nodelet.cc.

 All Classes Namespaces Files Functions Variables Defines


velodyne_ringcomp
Author(s): Joseph Campbell
autogenerated on Fri Jan 11 09:12:43 2013