scenario_simulator_v2 C++ API
traffic_simulator::entity::EntityManager Member List

This is the complete list of members for traffic_simulator::entity::EntityManager, including all inherited members.

broadcastEntityTransform()traffic_simulator::entity::EntityManager
broadcastTransform(const geometry_msgs::msg::PoseStamped &pose, const bool static_transform=true)traffic_simulator::entity::EntityManager
createPublisher(Args &&... args)traffic_simulator::entity::EntityManagerinline
createSubscription(Args &&... args)traffic_simulator::entity::EntityManagerinline
despawnEntity(const std::string &name)traffic_simulator::entity::EntityManager
EntityManager(NodeT &&node, const Configuration &configuration, const rclcpp::node_interfaces::NodeParametersInterface::SharedPtr &node_parameters)traffic_simulator::entity::EntityManagerinlineexplicit
getEgoEntity(const std::string &name) -> entity::EgoEntity &traffic_simulator::entity::EntityManager
getEgoEntity(const std::string &name) const -> const entity::EgoEntity &traffic_simulator::entity::EntityManager
getEntity(const std::string &name) -> entity::EntityBase &traffic_simulator::entity::EntityManager
getEntity(const std::string &name) const -> const entity::EntityBase &traffic_simulator::entity::EntityManager
getEntityNames() const -> const std::vector< std::string >traffic_simulator::entity::EntityManager
getEntityPointer(const std::string &name) const -> std::shared_ptr< traffic_simulator::entity::EntityBase >traffic_simulator::entity::EntityManager
getFirstEgoName() const -> std::optional< std::string >traffic_simulator::entity::EntityManager
getGoalPoses(const std::string &name) -> std::vector< T >traffic_simulator::entity::EntityManagerinline
getHdmapUtils() -> const std::shared_ptr< hdmap_utils::HdMapUtils > &traffic_simulator::entity::EntityManager
getNumberOfEgo() const -> std::size_ttraffic_simulator::entity::EntityManager
getObstacle(const std::string &name) -> std::optional< traffic_simulator_msgs::msg::Obstacle >traffic_simulator::entity::EntityManager
getOrigin(Node &node) consttraffic_simulator::entity::EntityManagerinline
getPedestrianParameters(const std::string &name) const -> const traffic_simulator_msgs::msg::PedestrianParameters &traffic_simulator::entity::EntityManager
getVehicleParameters(const std::string &name) const -> const traffic_simulator_msgs::msg::VehicleParameters &traffic_simulator::entity::EntityManager
getWaypoints(const std::string &name) -> traffic_simulator_msgs::msg::WaypointsArraytraffic_simulator::entity::EntityManager
isAnyEgoSpawned() const -> booltraffic_simulator::entity::EntityManager
isEntityExist(const std::string &name) const -> booltraffic_simulator::entity::EntityManager
isNpcLogicStarted() const -> booltraffic_simulator::entity::EntityManagerinline
makeDebugMarker() consttraffic_simulator::entity::EntityManager
resetBehaviorPlugin(const std::string &name, const std::string &behavior_plugin_name)traffic_simulator::entity::EntityManager
setTrafficLights(const std::shared_ptr< traffic_simulator::TrafficLights > &traffic_lights_ptr) -> voidtraffic_simulator::entity::EntityManagerinline
setVerbose(const bool verbose)traffic_simulator::entity::EntityManager
spawnEntity(const std::string &name, const Pose &pose, const Parameters &parameters, const double current_time, Ts &&... xs)traffic_simulator::entity::EntityManagerinline
startNpcLogic(const double current_time) -> voidtraffic_simulator::entity::EntityManager
update(const double current_time, const double step_time)traffic_simulator::entity::EntityManager
updateHdmapMarker()traffic_simulator::entity::EntityManager
updateNpcLogic(const std::string &name, const double current_time, const double step_time) -> const CanonicalizedEntityStatus &traffic_simulator::entity::EntityManager
~EntityManager()=defaulttraffic_simulator::entity::EntityManager