Classes | Namespaces | Typedefs | Functions | Variables
simulation_laser.cpp File Reference

Implementation simulation_laser ros node. More...

#include <ros/ros.h>
#include <ros/package.h>
#include <geometry_msgs/TransformStamped.h>
#include <nav_msgs/MapMetaData.h>
#include <sensor_msgs/LaserScan.h>
#include <tf/transform_listener.h>
#include <string>
#include <stdexcept>
#include <sensor_msgs/Range.h>
#include <yaml-cpp/yaml.h>
#include <dynamic_reconfigure/server.h>
#include <pses_simulation/RangeSensorConfig.h>
#include <pses_simulation/RangeSensor.h>
Include dependency graph for simulation_laser.cpp:

Go to the source code of this file.

Classes

struct  YAML::convert< geometry_msgs::Pose >
 Functor to decode/encode a YAML::Node. More...
 

Namespaces

 laserscan
 This namespace groups all typedefs, utility functions and parameter getter used in the simulation_laser node.
 
 YAML
 This namespace contains special functionality to parse from .yaml files or write to .yaml files.
 

Typedefs

typedef std::shared_ptr< geometry_msgs::Pose > laserscan::pose_msg_ptr
 shortcut for a pointer to a pose message More...
 
typedef std::shared_ptr< sensor_msgs::LaserScan > laserscan::scan_msg_ptr
 shortcut for a pointer to a laser scan message More...
 

Functions

void laserscan::configCallback (pses_simulation::RangeSensorConfig &config, uint32_t level, rs::RangeSensor *sensor, pses_simulation::RangeSensorConfig *dynConfig)
 Sets the RangeSensorConfig object of this sensor simulation. More...
 
void laserscan::fetchLaserscanFrameID (ros::NodeHandle *nh, std::string &laserscanFrameID)
 Get laser scan frame id launch parameter. More...
 
void laserscan::fetchLaserScanTopic (ros::NodeHandle *nh, std::string &laserScanTopic)
 Get laser scan topic launch parameter. More...
 
void laserscan::fetchLoopRate (ros::NodeHandle *nh, double &loopRate)
 Get loop rate launch parameter. More...
 
void laserscan::fetchMapFrameID (ros::NodeHandle *nh, std::string &mapFrameID)
 Get map frame id launch parameter. More...
 
void laserscan::fetchMapLocation (ros::NodeHandle *nh, std::string &mapLocation)
 Get map location launch parameter. More...
 
void laserscan::fetchMapMetadataLocation (ros::NodeHandle *nh, std::string &mapMetadataLocation)
 Get map meta data location launch parameter. More...
 
void laserscan::getPositionInfo (const std::string &base_frame, const std::string &target_frame, const tf::TransformListener &listener, geometry_msgs::Pose *position, std::vector< double > *rpy)
 Get the current postion of a sensor from the tf transformation service. More...
 
int main (int argc, char **argv)
 Main function of this ros node. More...
 
cv::Point laserscan::setGridPosition (geometry_msgs::Pose &laser, nav_msgs::MapMetaData &mapInfo)
 Calculate the occupancy grid postion of a given pose. More...
 

Variables

static const std::string laserscan::DEFAULT_LASER_SCAN_TOPIC
 
static const std::string laserscan::DEFAULT_LASERSCAN_FRAME_ID
 
static const double laserscan::DEFAULT_LOOP_RATE
 
static const std::string laserscan::DEFAULT_MAP_FRAME_ID
 
static const std::string laserscan::DEFAULT_MAP_LOCATION
 
static const std::string laserscan::DEFAULT_MAP_METADATA_LOCATION
 

Detailed Description

Implementation simulation_laser ros node.

Definition in file simulation_laser.cpp.

Function Documentation

int main ( int  argc,
char **  argv 
)

Main function of this ros node.

Definition at line 296 of file simulation_laser.cpp.



pses_simulation
Author(s): Sebastian Ehmes
autogenerated on Wed Dec 13 2017 19:37:54