#include <ros/ros.h>#include <ros/console.h>#include <nav_msgs/OccupancyGrid.h>#include <tf/tf.h>#include <tf/transform_listener.h>#include <tf/transform_datatypes.h>#include <map_ray_caster/map_ray_caster.h>#include <sensor_msgs/LaserScan.h>
Go to the source code of this file.
Functions | |
| void | handleCostmap (const nav_msgs::OccupancyGridConstPtr &msg) |
| int | main (int argc, char **argv) |
| sensor_msgs::LaserScan | rotateScan (sensor_msgs::LaserScan original_scan, float rotation) |
Variables | |
| map_ray_caster::MapRayCaster | caster_ |
| ros::Publisher * | fake_laser_absolute_publisher_ |
| ros::Publisher * | fake_laser_publisher_ |
| std::string | odom_frame_ |
| tf::TransformListener * | tf_listener_ |
| void handleCostmap | ( | const nav_msgs::OccupancyGridConstPtr & | msg | ) |
Definition at line 43 of file fake_laser_node.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 74 of file fake_laser_node.cpp.
| sensor_msgs::LaserScan rotateScan | ( | sensor_msgs::LaserScan | original_scan, |
| float | rotation | ||
| ) |
Definition at line 27 of file fake_laser_node.cpp.
Definition at line 23 of file fake_laser_node.cpp.
Definition at line 25 of file fake_laser_node.cpp.
Definition at line 24 of file fake_laser_node.cpp.
| std::string odom_frame_ |
Definition at line 21 of file fake_laser_node.cpp.
Definition at line 22 of file fake_laser_node.cpp.