#include <mvsim_node_core.h>
Public Attributes | |
visualization_msgs::msg::MarkerArray | chassis_shape_msg |
rclcpp::Publisher< geometry_msgs::msg::PoseWithCovarianceStamped >::SharedPtr | pub_amcl_pose |
"fake_localization" pubs: More... | |
rclcpp::Publisher< visualization_msgs::msg::MarkerArray >::SharedPtr | pub_chassis_markers |
"<VEH>/chassis_markers" More... | |
rclcpp::Publisher< geometry_msgs::msg::Polygon >::SharedPtr | pub_chassis_shape |
"<VEH>/chassis_shape" More... | |
rclcpp::Publisher< nav_msgs::msg::Odometry >::SharedPtr | pub_ground_truth |
"base_pose_ground_truth" topic More... | |
rclcpp::Publisher< nav_msgs::msg::Odometry >::SharedPtr | pub_odom |
Publisher of "odom" topic. More... | |
rclcpp::Publisher< geometry_msgs::msg::PoseArray >::SharedPtr | pub_particlecloud |
std::map< std::string, rclcpp::PublisherBase::SharedPtr > | pub_sensors |
Map <sensor_label> => publisher. More... | |
rclcpp::Subscription< geometry_msgs::msg::Twist >::SharedPtr | sub_cmd_vel |
Subscribers vehicle's "cmd_vel" topic. More... | |
Definition at line 142 of file mvsim_node_core.h.
visualization_msgs::msg::MarkerArray MVSimNode::TPubSubPerVehicle::chassis_shape_msg |
Definition at line 183 of file mvsim_node_core.h.
rclcpp::Publisher<geometry_msgs::msg::PoseWithCovarianceStamped>:: SharedPtr MVSimNode::TPubSubPerVehicle::pub_amcl_pose |
"fake_localization" pubs:
Definition at line 169 of file mvsim_node_core.h.
rclcpp::Publisher<visualization_msgs::msg::MarkerArray>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_chassis_markers |
"<VEH>/chassis_markers"
Definition at line 178 of file mvsim_node_core.h.
rclcpp::Publisher<geometry_msgs::msg::Polygon>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_chassis_shape |
"<VEH>/chassis_shape"
Definition at line 181 of file mvsim_node_core.h.
rclcpp::Publisher<nav_msgs::msg::Odometry>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_ground_truth |
"base_pose_ground_truth" topic
Definition at line 165 of file mvsim_node_core.h.
rclcpp::Publisher<nav_msgs::msg::Odometry>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_odom |
Publisher of "odom" topic.
Definition at line 163 of file mvsim_node_core.h.
rclcpp::Publisher<geometry_msgs::msg::PoseArray>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_particlecloud |
Definition at line 171 of file mvsim_node_core.h.
std::map<std::string, rclcpp::PublisherBase::SharedPtr> MVSimNode::TPubSubPerVehicle::pub_sensors |
Map <sensor_label> => publisher.
Definition at line 174 of file mvsim_node_core.h.
rclcpp::Subscription<geometry_msgs::msg::Twist>::SharedPtr MVSimNode::TPubSubPerVehicle::sub_cmd_vel |
Subscribers vehicle's "cmd_vel" topic.
Definition at line 161 of file mvsim_node_core.h.