scenario_simulator_v2 C++ API
|
This is the complete list of members for traffic_simulator::entity::EntityManager, including all inherited members.
broadcastEntityTransform() -> void | traffic_simulator::entity::EntityManager | |
broadcastTransform(const geometry_msgs::msg::PoseStamped &pose, const bool static_transform=true) -> void | traffic_simulator::entity::EntityManager | |
despawnEntity(const std::string &name) -> bool | traffic_simulator::entity::EntityManager | |
EntityManager(NodeT &&node, const Configuration &configuration, const rclcpp::node_interfaces::NodeParametersInterface::SharedPtr &node_parameters) | traffic_simulator::entity::EntityManager | inlineexplicit |
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< 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::EntityManager | inline |
getHdmapUtils() -> const std::shared_ptr< hdmap_utils::HdMapUtils > & | traffic_simulator::entity::EntityManager | |
getNumberOfEgo() const -> std::size_t | traffic_simulator::entity::EntityManager | |
getObstacle(const std::string &name) -> std::optional< traffic_simulator_msgs::msg::Obstacle > | traffic_simulator::entity::EntityManager | |
getOrigin(Node &node) const | traffic_simulator::entity::EntityManager | inline |
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::WaypointsArray | traffic_simulator::entity::EntityManager | |
isAnyEgoSpawned() const -> bool | traffic_simulator::entity::EntityManager | |
isEntityExist(const std::string &name) const -> bool | traffic_simulator::entity::EntityManager | |
isNpcLogicStarted() const -> bool | traffic_simulator::entity::EntityManager | |
makeDebugMarker() const -> visualization_msgs::msg::MarkerArray | traffic_simulator::entity::EntityManager | |
resetBehaviorPlugin(const std::string &name, const std::string &behavior_plugin_name) -> void | traffic_simulator::entity::EntityManager | |
setTrafficLights(const std::shared_ptr< TrafficLights > &traffic_lights_ptr) -> void | traffic_simulator::entity::EntityManager | |
setVerbose(const bool verbose) -> void | traffic_simulator::entity::EntityManager | |
spawnEntity(const std::string &name, const PoseType &pose, const ParametersType ¶meters, const double current_time, Ts &&... xs) -> entity::EntityBase & | traffic_simulator::entity::EntityManager | inline |
startNpcLogic(const double current_time) -> void | traffic_simulator::entity::EntityManager | |
update(const double current_time, const double step_time) -> void | traffic_simulator::entity::EntityManager | |
updateHdmapMarker() const -> void | traffic_simulator::entity::EntityManager | |
updateNpcLogic(const std::string &name, const double current_time, const double step_time) -> const CanonicalizedEntityStatus & | traffic_simulator::entity::EntityManager | |
~EntityManager()=default | traffic_simulator::entity::EntityManager |