Class CrowdSimInterface
Defined in File crowd_simulator_common.hpp
Nested Relationships
Nested Types
Class Documentation
-
class CrowdSimInterface
Public Types
Public Functions
-
inline CrowdSimInterface()
-
rclcpp::Logger logger() const
-
bool init_crowd_sim()
-
double get_sim_time_step() const
-
size_t get_num_objects() const
-
void one_step_sim(double time_step) const
-
double get_switch_anim_distance_th() const
-
std::vector<std::string> get_switch_anim_name() const
-
bool enabled() const
-
template<typename IgnMathPose3d>
void update_external_agent(size_t id, const IgnMathPose3d &model_pose)
-
template<typename IgnMathPose3d>
void update_external_agent(const AgentPtr agent_ptr, const IgnMathPose3d &model_pose)
-
template<typename IgnMathPose3d>
IgnMathPose3d get_agent_pose(size_t id, double delta_sim_time)
-
template<typename IgnMathPose3d>
IgnMathPose3d get_agent_pose(const AgentPtr agent_ptr, double delta_sim_time)
Public Members
-
std::shared_ptr<ModelTypeDatabase> _model_type_db_ptr
-
struct Object
-
inline CrowdSimInterface()