Esempio n. 1
0
 public JointState()
 {
     header = new std_msgs.Header();
     name = new List<string>();
     position = new List<double>();
     velocity = new List<double>();
     effort = new List<double>();
 }
Esempio n. 2
0
 public Range()
 {
     header = new std_msgs.Header();
     radiation_type = 0;
     field_of_view = 0.0f;
     min_range = 0.0f;
     max_range = 0.0f;
     range = 0.0f;
 }
Esempio n. 3
0
 public TrackerState()
 {
     header = new std_msgs.Header();
     ActiveTracks = 0;
     TotalTracks = 0;
     Tracks = new List<person_tracker.TrackedPerson>();
     TrackerType = 0;
     TrackerName = "";
 }
Esempio n. 4
0
 public Imu()
 {
     header = new std_msgs.Header();
     orientation = new geometry_msgs.Quaternion();
     orientation_covariance = new double[9];
     angular_velocity = new geometry_msgs.Vector3();
     angular_velocity_covariance = new double[9];
     linear_acceleration = new geometry_msgs.Vector3();
     linear_acceleration_covariance = new double[9];
 }
Esempio n. 5
0
 public Image()
 {
     header = new std_msgs.Header();
     height = 0;
     width = 0;
     encoding = "";
     is_bigendian = 0;
     step = 0;
     data = new List<System.Byte>();
 }
Esempio n. 6
0
 public PointCloud2()
 {
     header = new std_msgs.Header();
     height = 0;
     width = 0;
     fields = new List<sensor_msgs.PointField>();
     is_bigendian = false;
     point_step = 0;
     row_step = 0;
     data = new List<System.Byte>();
     is_dense = false;
 }
 public MultiEchoLaserScan()
 {
     header = new std_msgs.Header();
     angle_min = 0.0f;
     angle_max = 0.0f;
     angle_increment = 0.0f;
     time_increment = 0.0f;
     scan_time = 0.0f;
     range_min = 0.0f;
     range_max = 0.0f;
     ranges = new List<sensor_msgs.LaserEcho>();
     intensities = new List<sensor_msgs.LaserEcho>();
 }
Esempio n. 8
0
 public LaserScan()
 {
     header = new std_msgs.Header();
     angle_min = 0.0f;
     angle_max = 0.0f;
     angle_increment = 0.0f;
     time_increment = 0.0f;
     scan_time = 0.0f;
     range_min = 0.0f;
     range_max = 0.0f;
     ranges = new List<float>();
     intensities = new List<float>();
 }
Esempio n. 9
0
 public TrackedPerson()
 {
     header = new std_msgs.Header();
     Name = "";
     UID = 0;
     Pose = new geometry_msgs.Pose();
     Twist = new geometry_msgs.Twist();
     Skeleton = new person_tracker.SkeletonTrack();
     Hands = new List<person_tracker.HandTrack>();
     Confidence = 0.0f;
     TrackerType = 0;
     TrackerName = "";
 }
Esempio n. 10
0
 public CameraInfo()
 {
     header = new std_msgs.Header();
     height = 0;
     width = 0;
     distortion_model = "";
     D = new List<double>();
     K = new double[9];
     R = new double[9];
     P = new double[12];
     binning_x = 0;
     binning_y = 0;
     roi = new sensor_msgs.RegionOfInterest();
 }
Esempio n. 11
0
 public FluidPressure()
 {
     header         = new std_msgs.Header();
     fluid_pressure = 0.0;
     variance       = 0.0;
 }
Esempio n. 12
0
 public WrenchStamped()
 {
     header = new std_msgs.Header();
     wrench = new geometry_msgs.Wrench();
 }
 public GetMapActionResult(std_msgs.Header header, actionlib_msgs.GoalStatus status, nav_msgs.GetMapResult result)
 {
     this.header = header;
     this.status = status;
     this.result = result;
 }
 public PoseWithCovarianceStamped()
 {
     header = new std_msgs.Header();
     pose = new geometry_msgs.PoseWithCovariance();
 }
Esempio n. 15
0
 public FluidPressure(std_msgs.Header header, double fluid_pressure, double variance)
 {
     this.header         = header;
     this.fluid_pressure = fluid_pressure;
     this.variance       = variance;
 }
Esempio n. 16
0
 public TransformStamped()
 {
     header = new std_msgs.Header();
     child_frame_id = "";
     transform = new geometry_msgs.Transform();
 }
 public TwistWithCovarianceStamped()
 {
     header = new std_msgs.Header();
     twist = new geometry_msgs.TwistWithCovariance();
 }
Esempio n. 18
0
 public TimeReference()
 {
     this.header   = new std_msgs.Header();
     this.time_ref = new SIGVerse.RosBridge.msg_helpers.Time();
     this.source   = "";
 }
Esempio n. 19
0
 public TimeReference(std_msgs.Header header, SIGVerse.RosBridge.msg_helpers.Time time_ref, string source)
 {
     this.header   = header;
     this.time_ref = time_ref;
     this.source   = source;
 }
 public GoalStatusArray()
 {
     this.header      = new std_msgs.Header();
     this.status_list = new System.Collections.Generic.List <actionlib_msgs.GoalStatus>();
 }
 public GoalStatusArray(std_msgs.Header header, System.Collections.Generic.List <actionlib_msgs.GoalStatus> status_list)
 {
     this.header      = header;
     this.status_list = status_list;
 }
 public PoseWithCovarianceStamped()
 {
     header = new std_msgs.Header();
     pose   = new geometry_msgs.PoseWithCovariance();
 }
Esempio n. 23
0
 public GetMapActionGoal(std_msgs.Header header, actionlib_msgs.GoalID goal_id, nav_msgs.GetMapGoal goal)
 {
     this.header  = header;
     this.goal_id = goal_id;
     this.goal    = goal;
 }
Esempio n. 24
0
 public GetMapActionGoal()
 {
     this.header  = new std_msgs.Header();
     this.goal_id = new actionlib_msgs.GoalID();
     this.goal    = new nav_msgs.GetMapGoal();
 }
Esempio n. 25
0
 public Vector3Stamped()
 {
     header = new std_msgs.Header();
     vector = new geometry_msgs.Vector3();
 }
Esempio n. 26
0
 public PoseStamped()
 {
     header = new std_msgs.Header();
     pose   = new geometry_msgs.Pose();
 }
Esempio n. 27
0
 public TimeReference()
 {
     header = new std_msgs.Header();
     time_ref = new ROS_CS.Core.Time();
     source = "";
 }
Esempio n. 28
0
 public PoseStamped(std_msgs.Header _header, geometry_msgs.Pose _pose)
 {
     header = _header;
     pose   = _pose;
 }
Esempio n. 29
0
 public Joy()
 {
     header = new std_msgs.Header();
     axes = new List<float>();
     buttons = new List<System.Int32>();
 }
Esempio n. 30
0
 public Vector3Stamped()
 {
     this.header = new std_msgs.Header();
     this.vector = new UnityEngine.Vector3();
 }
Esempio n. 31
0
 public TopicUpdate()
 {
     header = new std_msgs.Header();
     TopicNames = new List<string>();
     TopicTypes = new List<string>();
 }
Esempio n. 32
0
 public Vector3Stamped(std_msgs.Header header, UnityEngine.Vector3 vector)
 {
     this.header = header;
     this.vector = vector;
 }
Esempio n. 33
0
 public FluidPressure()
 {
     this.header         = new std_msgs.Header();
     this.fluid_pressure = 0.0;
     this.variance       = 0.0;
 }
Esempio n. 34
0
 public OccupancyGrid(std_msgs.Header header, nav_msgs.MapMetaData info, System.Collections.Generic.List <sbyte> data)
 {
     this.header = header;
     this.info   = info;
     this.data   = data;
 }
Esempio n. 35
0
 public MagneticField()
 {
     header = new std_msgs.Header();
     magnetic_field = new geometry_msgs.Vector3();
     magnetic_field_covariance = new double[9];
 }
Esempio n. 36
0
 public DiagnosticArray(std_msgs.Header header, System.Collections.Generic.List <diagnostic_msgs.DiagnosticStatus> status)
 {
     this.header = header;
     this.status = status;
 }
 public GetMapActionResult()
 {
     this.header = new std_msgs.Header();
     this.status = new actionlib_msgs.GoalStatus();
     this.result = new nav_msgs.GetMapResult();
 }
 public TwistWithCovarianceStamped()
 {
     header = new std_msgs.Header();
     twist  = new geometry_msgs.TwistWithCovariance();
 }
Esempio n. 39
0
 public OccupancyGrid()
 {
     this.header = new std_msgs.Header();
     this.info   = new nav_msgs.MapMetaData();
     this.data   = new System.Collections.Generic.List <sbyte>();
 }
Esempio n. 40
0
 public PoseArray()
 {
     header = new std_msgs.Header();
     poses = new List<geometry_msgs.Pose>();
 }
Esempio n. 41
0
 public DiagnosticArray()
 {
     this.header = new std_msgs.Header();
     this.status = new System.Collections.Generic.List <diagnostic_msgs.DiagnosticStatus>();
 }
Esempio n. 42
0
 public PointCloud()
 {
     header = new std_msgs.Header();
     points = new List<geometry_msgs.Point32>();
     channels = new List<sensor_msgs.ChannelFloat32>();
 }
Esempio n. 43
0
 public GoalStatusArray()
 {
     header = new std_msgs.Header();
     status_list = new List<actionlib_msgs.GoalStatus>();
 }
Esempio n. 44
0
 public PointCloud()
 {
     this.header   = new std_msgs.Header();
     this.points   = new System.Collections.Generic.List <geometry_msgs.Point32>();
     this.channels = new System.Collections.Generic.List <sensor_msgs.ChannelFloat32>();
 }
Esempio n. 45
0
 public AggregatedMessages()
 {
     header = new std_msgs.Header();
     Messages = new List<datalink_msgs.SerializedMessage>();
 }
Esempio n. 46
0
 public PointCloud(std_msgs.Header header, System.Collections.Generic.List <geometry_msgs.Point32> points, System.Collections.Generic.List <sensor_msgs.ChannelFloat32> channels)
 {
     this.header   = header;
     this.points   = points;
     this.channels = channels;
 }
Esempio n. 47
0
 public WrenchStamped(std_msgs.Header _header, geometry_msgs.Wrench _wrench)
 {
     header = _header;
     wrench = _wrench;
 }
 public AccelWithCovarianceStamped()
 {
     this.header = new std_msgs.Header();
     this.accel  = new geometry_msgs.AccelWithCovariance();
 }
Esempio n. 49
0
 public JointTrajectory()
 {
     header = new std_msgs.Header();
     joint_names = new List<string>();
     points = new List<trajectory_msgs.JointTrajectoryPoint>();
 }
Esempio n. 50
0
 public WrenchStamped()
 {
     header = new std_msgs.Header();
     wrench = new geometry_msgs.Wrench();
 }
Esempio n. 51
0
 public PolygonStamped()
 {
     header = new std_msgs.Header();
     polygon = new geometry_msgs.Polygon();
 }
 public RelativeHumidity()
 {
     header = new std_msgs.Header();
     relative_humidity = 0.0;
     variance = 0.0;
 }
Esempio n. 53
0
 public Illuminance()
 {
     header = new std_msgs.Header();
     illuminance = 0.0;
     variance = 0.0;
 }
Esempio n. 54
0
 public Path()
 {
     this.header = new std_msgs.Header();
     this.poses  = new System.Collections.Generic.List <geometry_msgs.PoseStamped>();
 }
Esempio n. 55
0
 public PoseStamped()
 {
     header = new std_msgs.Header();
     pose = new geometry_msgs.Pose();
 }
Esempio n. 56
0
 public Path(std_msgs.Header header, System.Collections.Generic.List <geometry_msgs.PoseStamped> poses)
 {
     this.header = header;
     this.poses  = poses;
 }
 public AccelWithCovarianceStamped(std_msgs.Header header, geometry_msgs.AccelWithCovariance accel)
 {
     this.header = header;
     this.accel  = accel;
 }
Esempio n. 58
0
 public TwistStamped()
 {
     header = new std_msgs.Header();
     twist = new geometry_msgs.Twist();
 }
Esempio n. 59
0
 public Temperature()
 {
     header = new std_msgs.Header();
     temperature = 0.0;
     variance = 0.0;
 }
Esempio n. 60
0
 public AggregatedMessages()
 {
     header   = new std_msgs.Header();
     Messages = new List <teleop_msgs.SerializedMessage>();
 }