Namespaces | Functions | Variables
footstep_visualizer.py File Reference

Go to the source code of this file.

Namespaces

namespace  footstep_visualizer

Functions

def footstep_visualizer.llegCopCallback
def footstep_visualizer.matrixFromTranslationQuaternion
def footstep_visualizer.periodicCallback
def footstep_visualizer.rlegCopCallback
def footstep_visualizer.transformToMatrix
def footstep_visualizer.verticesPoints
def footstep_visualizer.zmpCallback

Variables

tuple footstep_visualizer.image_size = rospy.get_param("~image_size", 400)
 footstep_visualizer.lleg_cop_msg = None
tuple footstep_visualizer.lleg_end_coords = rospy.get_param("~lleg_end_coords", "lleg_end_coords")
tuple footstep_visualizer.lleg_sub = rospy.Subscriber("/lfsensor_cop", PointStamped, llegCopCallback)
tuple footstep_visualizer.lleg_vertices
tuple footstep_visualizer.msg_lock = Lock()
tuple footstep_visualizer.pub = rospy.Publisher("~output", Image)
 footstep_visualizer.rleg_cop_msg = None
tuple footstep_visualizer.rleg_end_coords = rospy.get_param("~rleg_end_coords", "rleg_end_coords")
tuple footstep_visualizer.rleg_sub = rospy.Subscriber("/rfsensor_cop", PointStamped, rlegCopCallback)
tuple footstep_visualizer.rleg_vertices
tuple footstep_visualizer.root_link = rospy.get_param("~root_link", "BODY")
tuple footstep_visualizer.scale = rospy.get_param("~scale", 0.6)
tuple footstep_visualizer.tf_buffer = tf2_ros.Buffer()
tuple footstep_visualizer.tf_listener = tf2_ros.TransformListener(tf_buffer)
 footstep_visualizer.zmp_msg = None
tuple footstep_visualizer.zmp_sub = rospy.Subscriber("/zmp", PointStamped, zmpCallback)


jsk_footstep_controller
Author(s):
autogenerated on Wed Sep 16 2015 04:38:12