24 from mpc_local_planner_msgs.msg
import OptimalControlResult
26 import matplotlib.pyplot
as plt
27 import matplotlib.ticker
as ticker
28 from threading
import Lock
49 rospy.loginfo(
"Plotting OCP results published on '%s'.",topic_name)
50 rospy.loginfo(
"Make sure to enable rosparam 'controller/publish_ocp_results' in the mpc_local_planner.")
53 rospy.loginfo_once(
"First message received.")
61 self.
tx = np.array(data.time_states)
62 self.
x = np.matrix(data.states)
64 self.
tu = np.array(data.time_controls)
65 self.
u = np.matrix(data.controls)
72 self.
x_axes[0].set_title(
'States')
73 for idx, ax
in enumerate(self.
x_axes):
74 ax.set_ylabel(
"x" + str(idx))
75 self.
x_axes[-1].set_xlabel(
'Time [s]')
78 self.
u_axes[0].set_title(
'Controls')
79 for idx, ax
in enumerate(self.
u_axes):
80 ax.set_ylabel(
"u" + str(idx)) 81 self.u_axes[-1].set_xlabel('Time [s]')
90 for idx, ax
in enumerate(self.
x_axes):
93 ax.plot(self.
tx, self.
x[:,idx])
94 ax.get_yaxis().set_major_formatter(ticker.FuncFormatter(
lambda x, p:
"%.2f" % x))
95 ax.set_ylabel(
"x" + str(idx))
96 self.
x_axes[0].set_title(
'States')
97 self.
x_axes[-1].set_xlabel(
'Time [s]')
98 self.
x_fig.canvas.draw()
100 for idx, ax
in enumerate(self.
u_axes):
103 ax.step(self.
tu, self.
u[:, idx], where=
'post')
104 ax.get_yaxis().set_major_formatter(ticker.FuncFormatter(
lambda x, p:
"%.2f" % x))
105 ax.set_ylabel(
"u" + str(idx)) 106 self.u_axes[0].set_title('Controls')
107 self.
u_axes[-1].set_xlabel(
'Time [s]')
108 self.
u_fig.canvas.draw()
113 while not rospy.is_shutdown():
123 if __name__ ==
'__main__':
126 rospy.init_node(
"ocp_result_plotter", anonymous=
True)
128 topic_name =
"/test_mpc_optim_node/ocp_result" 129 topic_name = rospy.get_param(
'~ocp_result_topic', topic_name)
131 plot_states = rospy.get_param(
'~plot_states',
False)
135 topic_name = rospy.get_param(
'~plot_rate', rate)
136 result_plotter.start(rate)
137 except rospy.ROSInterruptException:
def __init__(self, plot_states, topic_name)
def initializePlotWindows(self)
def ocp_result_callback(self, data)