Macros | Typedefs | Variables
mvsim_node.cpp File Reference
#include <mrpt/core/lock_helper.h>
#include <mrpt/system/filesystem.h>
#include <mrpt/system/os.h>
#include <mrpt/version.h>
#include <mvsim/WorldElements/OccupancyGridMap.h>
#include <mvsim/mvsim_node_core.h>
#include "rapidxml_utils.hpp"
#include <mrpt/ros2bridge/image.h>
#include <mrpt/ros2bridge/imu.h>
#include <mrpt/ros2bridge/laser_scan.h>
#include <mrpt/ros2bridge/map.h>
#include <mrpt/ros2bridge/point_cloud2.h>
#include <mrpt/ros2bridge/pose.h>
#include <sensor_msgs/msg/image.hpp>
#include <sensor_msgs/msg/imu.hpp>
#include <sensor_msgs/msg/laser_scan.hpp>
#include <sensor_msgs/msg/nav_sat_fix.hpp>
#include <sensor_msgs/msg/point_cloud2.hpp>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <tf2_ros/qos.hpp>
Include dependency graph for mvsim_node.cpp:

Go to the source code of this file.

Macros

#define ROS12_ERROR(...)   RCLCPP_ERROR(n_->get_logger(), __VA_ARGS__)
 
#define ROS12_INFO(...)   RCLCPP_INFO(n_->get_logger(), __VA_ARGS__)
 
#define ROS12_WARN_STREAM_THROTTLE(...)   RCLCPP_WARN_STREAM_THROTTLE(n_->get_logger(), *clock_, __VA_ARGS__)
 
#define ROS12_WARN_THROTTLE(...)   RCLCPP_WARN_THROTTLE(n_->get_logger(), *clock_, __VA_ARGS__)
 

Typedefs

using Msg_GPS = sensor_msgs::msg::NavSatFix
 
using Msg_Header = std_msgs::msg::Header
 
using Msg_Image = sensor_msgs::msg::Image
 
using Msg_Imu = sensor_msgs::msg::Imu
 
using Msg_LaserScan = sensor_msgs::msg::LaserScan
 
using Msg_Marker = visualization_msgs::msg::Marker
 
using Msg_PointCloud2 = sensor_msgs::msg::PointCloud2
 
using Msg_Pose = geometry_msgs::msg::Pose
 
using Msg_TransformStamped = geometry_msgs::msg::TransformStamped
 

Variables

const double MAX_CMD_VEL_AGE_SECONDS = 1.0
 

Macro Definition Documentation

◆ ROS12_ERROR

#define ROS12_ERROR (   ...)    RCLCPP_ERROR(n_->get_logger(), __VA_ARGS__)

Definition at line 118 of file mvsim_node.cpp.

◆ ROS12_INFO

#define ROS12_INFO (   ...)    RCLCPP_INFO(n_->get_logger(), __VA_ARGS__)

Definition at line 114 of file mvsim_node.cpp.

◆ ROS12_WARN_STREAM_THROTTLE

#define ROS12_WARN_STREAM_THROTTLE (   ...)    RCLCPP_WARN_STREAM_THROTTLE(n_->get_logger(), *clock_, __VA_ARGS__)

Definition at line 116 of file mvsim_node.cpp.

◆ ROS12_WARN_THROTTLE

#define ROS12_WARN_THROTTLE (   ...)    RCLCPP_WARN_THROTTLE(n_->get_logger(), *clock_, __VA_ARGS__)

Definition at line 115 of file mvsim_node.cpp.

Typedef Documentation

◆ Msg_GPS

using Msg_GPS = sensor_msgs::msg::NavSatFix

Definition at line 93 of file mvsim_node.cpp.

◆ Msg_Header

Definition at line 88 of file mvsim_node.cpp.

◆ Msg_Image

using Msg_Image = sensor_msgs::msg::Image

Definition at line 94 of file mvsim_node.cpp.

◆ Msg_Imu

using Msg_Imu = sensor_msgs::msg::Imu

Definition at line 95 of file mvsim_node.cpp.

◆ Msg_LaserScan

using Msg_LaserScan = sensor_msgs::msg::LaserScan

Definition at line 96 of file mvsim_node.cpp.

◆ Msg_Marker

using Msg_Marker = visualization_msgs::msg::Marker

Definition at line 99 of file mvsim_node.cpp.

◆ Msg_PointCloud2

using Msg_PointCloud2 = sensor_msgs::msg::PointCloud2

Definition at line 97 of file mvsim_node.cpp.

◆ Msg_Pose

Definition at line 90 of file mvsim_node.cpp.

◆ Msg_TransformStamped

using Msg_TransformStamped = geometry_msgs::msg::TransformStamped

Definition at line 91 of file mvsim_node.cpp.

Variable Documentation

◆ MAX_CMD_VEL_AGE_SECONDS

const double MAX_CMD_VEL_AGE_SECONDS = 1.0

Definition at line 121 of file mvsim_node.cpp.



mvsim
Author(s):
autogenerated on Wed May 28 2025 02:13:09