Public Member Functions | Public Attributes | Private Attributes
nj_oa_costmap::TwistHandler Class Reference

#include <twist_handler.h>

Inheritance diagram for nj_oa_costmap::TwistHandler:
Inheritance graph
[legend]

List of all members.

Public Member Functions

geometry_msgs::Twist getTwist (const nav_msgs::OccupancyGrid &map)
 TwistHandler (const double robot_radius, const std::string &laser_frame)

Public Attributes

unsigned int fake_laser_beam_count
 beam count for the scan obtained from the map. Should be at least 2.
std::string laser_frame
 Name of the frame the map is based on.
double range_max
 (m), max range for beams that don't encounter any occupied or unknown point on the map.

Private Attributes

map_ray_caster::MapRayCaster ray_caster_
 Ray casting with cache to compute a fake LaserScan.
tf::TransformListener tf_listerner_

Detailed Description

Definition at line 18 of file twist_handler.h.


Constructor & Destructor Documentation

nj_oa_costmap::TwistHandler::TwistHandler ( const double  robot_radius,
const std::string &  laser_frame 
)

Definition at line 6 of file twist_handler.cpp.


Member Function Documentation

geometry_msgs::Twist nj_oa_costmap::TwistHandler::getTwist ( const nav_msgs::OccupancyGrid &  map)

Definition at line 14 of file twist_handler.cpp.


Member Data Documentation

beam count for the scan obtained from the map. Should be at least 2.

Definition at line 27 of file twist_handler.h.

Name of the frame the map is based on.

Definition at line 26 of file twist_handler.h.

(m), max range for beams that don't encounter any occupied or unknown point on the map.

Definition at line 28 of file twist_handler.h.

Ray casting with cache to compute a fake LaserScan.

Definition at line 32 of file twist_handler.h.

Definition at line 33 of file twist_handler.h.


The documentation for this class was generated from the following files:


nj_oa_costmap
Author(s): Gaël Ecorchard , Karel Košnar
autogenerated on Sat Jun 8 2019 20:58:44