nav2_simple_commander.utils module
General utility functions.
- nav2_simple_commander.utils.euler_to_quaternion(roll: float = 0.0, pitch: float = 0.0, yaw: float = 0.0) → geometry_msgs.msg.Quaternion
Convert euler angles to quaternion.
- nav2_simple_commander.utils.find_os_processes(name: str) → list[tuple[str, str]]
Find all the processes that are running gz sim.
- nav2_simple_commander.utils.kill_os_processes(name: str) → None
Kill all processes that are running with name.
- nav2_simple_commander.utils.kill_process(pid: str) → None
Kill a process with a given PID.