Functions
init_utils.h File Reference
#include <string>
#include <memory>
#include <ros/ros.h>
#include "../core/states/world.h"
#include "../utils/properties_providers.h"
#include "topic_with_transform.h"
#include "pose_correction_tf_publisher.h"
#include "robot_pose_observers.h"
#include "occupancy_grid_publisher.h"
Include dependency graph for init_utils.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Functions

template<typename MapT >
std::shared_ptr< OccupancyGridPublisher< MapT > > create_occupancy_grid_publisher (WorldObservable< MapT > *slam, ros::NodeHandle nh, double ros_map_publishing_rate)
 
template<typename ObservT , typename MapT >
std::shared_ptr< PoseCorrectionTfPublisher< ObservT > > create_pose_correction_tf_publisher (WorldObservable< MapT > *slam, TopicWithTransform< ObservT > *scan_prov, const PropertiesProvider &props)
 
template<typename MapT >
std::shared_ptr< RobotPoseTfPublishercreate_robot_pose_tf_publisher (WorldObservable< MapT > *slam)
 
bool get_skip_exceeding_lsr (const PropertiesProvider &props)
 
std::string get_string_param (const std::string &name, const std::string &dflt_value)
 
bool get_use_trig_cache (const PropertiesProvider &props)
 
void init_constants_for_ros (double &ros_tf_buffer_size, double &ros_map_rate, int &ros_filter_queue, int &ros_subscr_queue)
 
bool is_async_correction ()
 
std::string laser_scan_2D_ros_topic_name (const PropertiesProvider &props)
 
template<typename ObservT , typename MapT >
auto make_pose_correction_observation_stamped_publisher (WorldObservable< MapT > *slam, TopicWithTransform< ObservT > *scan_provider, const PropertiesProvider &props)
 
auto tf_ignored_transforms (const PropertiesProvider &props)
 
std::string tf_map_frame_id ()
 
std::string tf_odom_frame_id (const PropertiesProvider &props)
 
std::string tf_robot_pose_frame_id ()
 

Function Documentation

template<typename MapT >
std::shared_ptr<OccupancyGridPublisher<MapT> > create_occupancy_grid_publisher ( WorldObservable< MapT > *  slam,
ros::NodeHandle  nh,
double  ros_map_publishing_rate 
)

Definition at line 128 of file init_utils.h.

template<typename ObservT , typename MapT >
std::shared_ptr<PoseCorrectionTfPublisher<ObservT> > create_pose_correction_tf_publisher ( WorldObservable< MapT > *  slam,
TopicWithTransform< ObservT > *  scan_prov,
const PropertiesProvider props 
)

Definition at line 92 of file init_utils.h.

template<typename MapT >
std::shared_ptr<RobotPoseTfPublisher> create_robot_pose_tf_publisher ( WorldObservable< MapT > *  slam)

Definition at line 105 of file init_utils.h.

bool get_skip_exceeding_lsr ( const PropertiesProvider props)

Definition at line 49 of file init_utils.h.

std::string get_string_param ( const std::string &  name,
const std::string &  dflt_value 
)

Definition at line 18 of file init_utils.h.

bool get_use_trig_cache ( const PropertiesProvider props)

Definition at line 56 of file init_utils.h.

void init_constants_for_ros ( double &  ros_tf_buffer_size,
double &  ros_map_rate,
int &  ros_filter_queue,
int &  ros_subscr_queue 
)

Definition at line 138 of file init_utils.h.

bool is_async_correction ( )

Definition at line 41 of file init_utils.h.

std::string laser_scan_2D_ros_topic_name ( const PropertiesProvider props)

Definition at line 25 of file init_utils.h.

template<typename ObservT , typename MapT >
auto make_pose_correction_observation_stamped_publisher ( WorldObservable< MapT > *  slam,
TopicWithTransform< ObservT > *  scan_provider,
const PropertiesProvider props 
)

Definition at line 113 of file init_utils.h.

auto tf_ignored_transforms ( const PropertiesProvider props)

Definition at line 62 of file init_utils.h.

std::string tf_map_frame_id ( )

Definition at line 33 of file init_utils.h.

std::string tf_odom_frame_id ( const PropertiesProvider props)

Definition at line 29 of file init_utils.h.

std::string tf_robot_pose_frame_id ( )

Definition at line 37 of file init_utils.h.



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