dwb_msgs/LocalPlanEvaluation Message

File: dwb_msgs/LocalPlanEvaluation.msg

Raw Message Definition

# Full Scoring for running the local planner

# Header, used for timestamp
Header header
# All the trajectories evaluated and their scores
TrajectoryScore[] twists
# Convenience index of the best (lowest) score in the twists array
uint16 best_index
# Convenience index of the worst (highest) score in the twists array. Useful for scaling.
uint16 worst_index

Compact Message Definition

std_msgs/Header header
dwb_msgs/TrajectoryScore[] twists
uint16 best_index
uint16 worst_index