#include <mvsim_node_core.h>
Public Attributes | |
Msg_MarkerArray | chassis_shape_msg |
rclcpp::Publisher< Msg_PoseWithCovarianceStamped >::SharedPtr | pub_amcl_pose |
"fake_localization" pubs: More... | |
rclcpp::Publisher< Msg_MarkerArray >::SharedPtr | pub_chassis_markers |
"<VEH>/chassis_markers" More... | |
rclcpp::Publisher< Msg_Polygon >::SharedPtr | pub_chassis_shape |
"<VEH>/chassis_shape" More... | |
rclcpp::Publisher< Msg_Bool >::SharedPtr | pub_collision |
"<VEH>/collision" More... | |
rclcpp::Publisher< Msg_Odometry >::SharedPtr | pub_ground_truth |
"base_pose_ground_truth" topic More... | |
rclcpp::Publisher< Msg_Odometry >::SharedPtr | pub_odom |
Publisher of "odom" topic. More... | |
rclcpp::Publisher< Msg_PoseArray >::SharedPtr | pub_particlecloud |
std::map< std::string, mvsim_node::shared_ptr< PublisherWrapperBase > > | pub_sensors |
Map <sensor_label> => publisher. More... | |
rclcpp::Publisher< Msg_TFMessage >::SharedPtr | pub_tf |
"<VEH>/tf", "<VEH>/tf_static" More... | |
rclcpp::Publisher< Msg_TFMessage >::SharedPtr | pub_tf_static |
rclcpp::Subscription< Msg_Twist >::SharedPtr | sub_cmd_vel |
Subscribers vehicle's "cmd_vel" topic. More... | |
Definition at line 209 of file mvsim_node_core.h.
Msg_MarkerArray MVSimNode::TPubSubPerVehicle::chassis_shape_msg |
Definition at line 262 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_PoseWithCovarianceStamped>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_amcl_pose |
"fake_localization" pubs:
Definition at line 245 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_MarkerArray>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_chassis_markers |
"<VEH>/chassis_markers"
Definition at line 252 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_Polygon>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_chassis_shape |
"<VEH>/chassis_shape"
Definition at line 254 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_Bool>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_collision |
"<VEH>/collision"
Definition at line 256 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_Odometry>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_ground_truth |
"base_pose_ground_truth" topic
Definition at line 242 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_Odometry>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_odom |
Publisher of "odom" topic.
Definition at line 240 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_PoseArray>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_particlecloud |
Definition at line 246 of file mvsim_node_core.h.
std::map<std::string, mvsim_node::shared_ptr<PublisherWrapperBase> > MVSimNode::TPubSubPerVehicle::pub_sensors |
Map <sensor_label> => publisher.
Definition at line 249 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_TFMessage>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_tf |
"<VEH>/tf", "<VEH>/tf_static"
Definition at line 259 of file mvsim_node_core.h.
rclcpp::Publisher<Msg_TFMessage>::SharedPtr MVSimNode::TPubSubPerVehicle::pub_tf_static |
Definition at line 260 of file mvsim_node_core.h.
rclcpp::Subscription<Msg_Twist>::SharedPtr MVSimNode::TPubSubPerVehicle::sub_cmd_vel |
Subscribers vehicle's "cmd_vel" topic.
Definition at line 237 of file mvsim_node_core.h.