$search

people_detector_node.cpp File Reference

Wrapper node around the Oscar Martinez Mozos's people detector code. More...

#include <iostream>
#include <float.h>
#include <PeopleDetector.h>
#include <ros/ros.h>
#include <ros/node_handle.h>
#include <sensor_msgs/LaserScan.h>
Include dependency graph for people_detector_node.cpp:

Go to the source code of this file.

Classes

class  PeopleDetectorNode

Functions

int main (int argc, char **argv)

Detailed Description

Wrapper node around the Oscar Martinez Mozos's people detector code.

Advertises
  • people_detected topic with LaserScan message (values 1 in the intensities channel denote true positive classification of human legs)
Subscribes
  • /scan with LaserScan message
Parameters
  • string input_scan_topic_, output_scan_topic_;
  • string hypotheses_filename_;
  • int num_hypotheses_;
  • double threshold_;
  • FILE *f_hypotheses;
  • int list_size_;

Definition in file people_detector_node.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 209 of file people_detector_node.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


people_detector_node
Author(s): Oscar Martinez Mozos, Dejan Pangercic(ROS)
autogenerated on Tue Dec 4 05:02:00 2012