Typedefs | Functions | Variables
wg_pr2_bag_adapter.cpp File Reference
#include <utility>
#include <boost/shared_ptr.hpp>
#include <ros/ros.h>
#include <nav_msgs/OccupancyGrid.h>
#include <tf/tfMessage.h>
#include <tf/transform_broadcaster.h>
#include "launch_properties_provider.h"
#include "init_utils.h"
Include dependency graph for wg_pr2_bag_adapter.cpp:

Go to the source code of this file.

Typedefs

using OccGridMsg = nav_msgs::OccupancyGrid
 

Functions

int main (int argc, char **argv)
 
void on_gt_grid (boost::shared_ptr< nav_msgs::OccupancyGrid > msg)
 
void on_tf_msg (boost::shared_ptr< tf::tfMessage > msg)
 

Variables

bool gt2map_is_initialized = false
 
geometry_msgs::TransformStamped gt2map_transform
 
OccGridMsg provided_grid
 

Typedef Documentation

using OccGridMsg = nav_msgs::OccupancyGrid

Definition at line 13 of file wg_pr2_bag_adapter.cpp.

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 48 of file wg_pr2_bag_adapter.cpp.

void on_gt_grid ( boost::shared_ptr< nav_msgs::OccupancyGrid >  msg)

Definition at line 19 of file wg_pr2_bag_adapter.cpp.

void on_tf_msg ( boost::shared_ptr< tf::tfMessage >  msg)

Definition at line 24 of file wg_pr2_bag_adapter.cpp.

Variable Documentation

bool gt2map_is_initialized = false

Definition at line 17 of file wg_pr2_bag_adapter.cpp.

geometry_msgs::TransformStamped gt2map_transform

Definition at line 16 of file wg_pr2_bag_adapter.cpp.

OccGridMsg provided_grid

Definition at line 14 of file wg_pr2_bag_adapter.cpp.



slam_constructor
Author(s): JetBrains Research, OSLL team
autogenerated on Mon Jun 10 2019 15:08:25