simulation.src.simulation_evaluation.src.drive_test package

Submodules

simulation.src.simulation_evaluation.src.drive_test.node module

Classes:

DriveTestNode(run)

Complete an automatic test using this node.

class DriveTestNode(run: bool = True)[source]

Bases: simulation.utils.ros_base.node_base.NodeBase

Complete an automatic test using this node.

Also the gazebo simulation, KITcar_brain and the CarStateNode needs to be running.

Methods:

start()

Called when activating the node.

stop()

Called when deactivating or shutting down the node.

receive_groundtruth_update(msg)

Receive GroundtruthStatus message.

receive_state_machine_info(msg)

Receive info message when state machines change.

update_mission_mode(mission_mode)

Change the car’s mission mode.

referee_cb(msg)

Listen for changes in the referee status.

start()[source]

Called when activating the node.

stop()[source]

Called when deactivating or shutting down the node.

receive_groundtruth_update(msg: simulation_groundtruth.msg._GroundtruthStatus.GroundtruthStatus)[source]

Receive GroundtruthStatus message.

Parameters

msg – New GroundtruthStatus message

receive_state_machine_info(msg: std_msgs.msg._String.String)[source]

Receive info message when state machines change.

Parameters

msg – New string message

update_mission_mode(mission_mode: int)[source]

Change the car’s mission mode.

Parameters

mission_mode – Desired mission mode.

referee_cb(msg: simulation_evaluation.msg._Referee.Referee)[source]

Listen for changes in the referee status.

Module contents