#include <ros/ros.h>#include <nav_msgs/OccupancyGrid.h>#include <dynamic_reconfigure/server.h>#include <riskrrt/OccupancyGridArray.h>#include <riskrrt/PoseTwistStamped.h>#include <riskrrt/Trajectory.h>#include <vector>#include <iostream>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| void | OGCallback (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
Variables | |
| nav_msgs::OccupancyGrid | grid |
| int | nbMap |
| riskrrt::OccupancyGridArray | og_array |
| riskrrt::Trajectory | traj |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 26 of file og_builder.cpp.
| void OGCallback | ( | const nav_msgs::OccupancyGrid::ConstPtr & | msg | ) |
Definition at line 17 of file og_builder.cpp.
| nav_msgs::OccupancyGrid grid |
Definition at line 12 of file og_builder.cpp.
| int nbMap |
Definition at line 15 of file og_builder.cpp.
| riskrrt::OccupancyGridArray og_array |
Definition at line 13 of file og_builder.cpp.
| riskrrt::Trajectory traj |
Definition at line 14 of file og_builder.cpp.