-
 

Package Summary

Tags No category tags.
Version 1.13.1
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version noetic-devel
Last Updated 2021-01-11
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.13.1 (2021-01-11)

  • Update package maintainers (#168)
  • Contributors: Michel Hidalgo

1.13.0 (2020-05-21)

  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn't recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ainstein_radar_msgs
amr_interop_bridge
amr_interop_msgs
apriltag_ros
arbotix_python
aruco_msgs
aruco_ros
dock
perch
ff_msgs
handrail_detect
marker_tracking
vive_localization
framestore
msg_conversions
derived_object_msgs
automotive_navigation_msgs
autoware_msgs
auv_msgs
axis_camera
bagger
bota_driver_testing
rokubimini
rokubimini_msgs
calibration_msgs
image_cb_detector
interval_intersection
capabilities
carla_msgs
cartesian_control_msgs
cartesian_msgs
cob_script_server
cob_teleop
scenario_test_tools
cob_actions
cob_srvs
cob_base_controller_utils
cob_base_velocity_smoother
cob_cartesian_controller
cob_collision_velocity_filter
cob_control_msgs
cob_footprint_observer
cob_frame_tracker
cob_mecanum_controller
cob_model_identifier
cob_obstacle_distance
cob_omni_drive_controller
cob_tricycle_controller
cob_twist_controller
cob_undercarriage_ctrl
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_linear_nav
cob_map_accessibility_analysis
cob_3d_mapping_msgs
cob_image_flip
cob_object_detection_msgs
cob_perception_msgs
cob_gazebo_tools
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
computer_status_msgs
control_msgs
costmap_converter
crane_x7_examples
cras_imu_tools
cras_cpp_common
cras_py_common
cras_topic_tools
tf_static_publisher
create_driver
criutils
dataspeed_ulc_can
dbw_fca_can
dbw_fca_msgs
dbw_mkz_can
dbw_mkz_msgs
dbw_polaris_can
dbw_polaris_msgs
depthai_ros_msgs
dual_quaternions_ros
dynamixel_workbench_controllers
dynamixel_workbench_operators
ensenso_camera
ensenso_camera_msgs
er_public_msgs
ess_imu_ros1_uart_driver
exotica_core_task_maps
exotica_core
exotica_examples
exotica_python
fetch_auto_dock_msgs
fetch_driver_msgs
fetch_open_auto_dock
fetch_depth_layer
fetch_teleop
fiducial_msgs
stag_detect
find_object_2d
flexbe_states
floam
foxglove_msgs
frame_editor
franka_control
franka_example_controllers
franka_gazebo
fuse_constraints
fuse_core
fuse_models
fuse_optimizers
fuse_publishers
fuse_viz
gazebo_msgs
gazebo_plugins
gazebo_ros
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_msgs
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
graceful_controller_ros
graft
graph_msgs
grasping_msgs
grid_map_demos
grid_map_msgs
grid_map_ros
haf_grasping
handeye
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hector_nav_msgs
hfl_driver
image_rotate
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
inno_sim_interface
innopolis_vtol_dynamics
iris_lama_ros
ixblue_ins_msgs
spacenav_node
wiimote
respeaker_ros
respeaker_ros
dynamic_tf_publisher
image_view2
jsk_topic_tools
virtual_force_publisher
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
audio_to_spectrogram
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
roseus
jsk_interactive
jsk_interactive_marker
jsk_rviz_plugins
kvh_geo_fog_3d_driver
leo_bringup
leo_gazebo
lgsvl_msgs
hri
lsm_localization
explore_lite
multirobot_map_merge
multires_image
marker_msgs
swri_image_util
swri_transform_util
marti_nav_msgs
marti_sensor_msgs
marti_visualization_msgs
mavros
mavros_extras
mavros_msgs
test_mavros
mcl_3dl
microstrain_inertial_driver
microstrain_inertial_msgs
microstrain_inertial_rqt
mir_actions
mir_driver
mir_dwb_critics
mir_msgs
mobile_robot_simulator
mocap_nokov
mocap_optitrack
mongodb_store
mbf_abstract_core
mbf_abstract_nav
mbf_costmap_core
mbf_costmap_nav
mbf_msgs
mbf_simple_nav
mbf_utility
move_base_sequence
move_base_swp
move_basic
moveit_commander
moveit_core
moveit_servo
moveit_ros_planning_interface
moveit_msgs
moveit_python
moveit_visual_tools
mpc_local_planner
mrpt_msgs
mrpt_msgs_bridge
mrpt_reactivenav2d
mrpt_sensorlib
mrpt_graphslam_2d
multisense_ros
naoqi_bridge_msgs
naoqi_driver
amcl
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_slow_and_clear
nav_core
navfn
rotate_recovery
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
assisted_teleop
pose_base_controller
sbpl_lattice_planner
twist_recovery
move_base_msgs
nearfield_map
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
costmap_cspace_msgs
planner_cspace_msgs
trajectory_tracker_msgs
nmea_navsat_driver
nonpersistent_voxel_layer
object_recognition_msgs
octomap_msgs
octomap_pa_msgs
open_manipulator_msgs
osm_cartography
route_network
ov_eval
ov_msckf
outsight_alb_driver
oxford_gps_eth
p2os_driver
p2os_teleop
p2os_urdf
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
pcl_ros
pilz_control
pose_cov_ops
pr2_teleop
pr2_teleop_general
pr2_msgs
pr2_arm_move_ik
pr2_common_action_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_arm_kinematics
pr2_hardware_interface
pr2_navigation_perception
pr2_gazebo
pr2_gazebo_plugins
psen_scan_v2
py_trees_ros
qb_chain_controllers
qb_chain_msgs
radar_pa
pdu_msgs
raptor_dbw_can
raptor_dbw_msgs
rc_genicam_driver
rc_reason_msgs
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
ridgeback_gazebo_plugins
robot_body_filter
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
dlux_global_planner
dwb_critics
dwb_local_planner
dwb_msgs
locomotor
nav_2d_msgs
nav_2d_utils
nav_core_adapter
nav_grid_pub_sub
robot_nav_rviz_plugins
robot_nav_viz_demos
rqt_dwb_plugin
robot_pose_ekf
ros_babel_fish
ros_babel_fish_test_msgs
ackermann_steering_controller
diff_drive_controller
force_torque_sensor_controller
four_wheel_steering_controller
cartesian_interface
twist_controller
inorbit_republisher
ros_numpy
turtlesim
rosbridge_library
roscompile
rosee_msg
cl_transforms_stamped
rosmsg_cpp
rospilot
rosserial_windows
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_nav_view
rqt_pose_view
rqt_py_trees
rqt_robot_steering
rtabmap_conversions
rtabmap_msgs
rtabmap_slam
rtabmap_viz
rviz
rviz_animated_view_controller
rviz_visual_tools
sbg_driver
laser_ortho_projector
laser_scan_matcher
polar_scan_matcher
sciurus17_examples
sciurus17_msgs
sciurus17_vision
septentrio_gnss_driver
sick_ldmrs_msgs
simple_grasping
slam_toolbox_msgs
backward_global_planner
backward_local_planner
forward_global_planner
forward_local_planner
pure_spinning_local_planner
undo_path_global_planner
snowbot_operating_system
spatio_temporal_voxel_layer
stag_ros
stage_ros
steering_functions
teb_local_planner
teleop_legged_robots
key_teleop
mouse_teleop
teleop_twist_joy
teleop_twist_keyboard
tf2_server
tf2_web_republisher
turtlebot3_example
turtlebot3_teleop
turtlebot3_fake
turtlebot3_gazebo
tuw_airskin_msgs
tuw_gazebo_msgs
tuw_geometry_msgs
tuw_local_controller_msgs
tuw_multi_robot_msgs
tuw_nav_msgs
tuw_object_msgs
tuw_vehicle_msgs
tuw_multi_robot_ctrl
tuw_multi_robot_local_behavior_controller
tuw_multi_robot_router
tuw_voronoi_graph
twist_mux
uavcan_communicator
ubiquity_motor
ur_kinematics
ur_msgs
ur_robot_driver
variant_topic_tools
view_controller_msgs
vision_msgs
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
rwt_nav
rwt_plot
volta_teleoperator
vrpn_client_ros
warehouse_ros
wifi_ddwrt
witmotion_ros
easy_markers
xpp_msgs
ypspur_ros
z_laser_gui
z_laser_msgs
z_laser_viz
darknet_ros_msgs
aruco_opencv_msgs
clober_simulation
clober_tools
clpe_ros
bosch_locator_bridge
radar_msgs
massrobotics_amr_sender
ros_ign_bridge
adi_tmc_coe
adi_tmcl
astra_ros
beluga_ros
clearpath_configuration_msgs
clearpath_control_msgs
clearpath_dock_msgs
clearpath_localization_msgs
clearpath_logger_msgs
clearpath_navigation_msgs
clearpath_safety_msgs
clearpath_onav_api_examples_lib
magnetometer_compass
cras_relative_positional_controller
ergodic_exploration
ess_imu_driver
etsi_its_msgs_utils
fields2cover_ros
flatland_msgs
flatland_server
gmcl
gnss_info_msgs
gnsstk_ros
gpp_interface
hri_actions_msgs
iotbot
leo_example_follow_ar_tag
leo_example_line_follower
line_planner
marine_acoustic_msgs
message_tf_frame_transformer
mitch_v2_driver
moveit_task_constructor_core
rviz_marker_tools
mrpt_apps
mrpt_libros_bridge
muse_v2_driver
py_binding_tools
pyhri
quori_arm_controller
quori_face
quori_holonomic_drive_controller
quori_mapping_odometry
raspimouse_control
rm_common
rm_msgs
rose2
serl_franka_controllers
sick_scan_xd
thunder_line_follower_pmr3100
turtlebot3_autorace_detect
turtlebot3_autorace_driving
vizanti
xsens_mti_driver

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn't recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
ar_track_alvar_msgs
arbotix_python
asr_msgs
automotive_navigation_msgs
auv_msgs
axis_camera
calibration_msgs
image_cb_detector
interval_intersection
capabilities
cartesian_msgs
cartographer_ros
cartographer_ros_msgs
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
control_msgs
costmap_converter
ensenso_camera
ensenso_camera_msgs
fawkes_msgs
flexbe_states
frame_editor
franka_control
franka_example_controllers
gazebo_msgs
gazebo_plugins
gazebo_ros
generic_control_toolbox
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_msgs
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
graph_msgs
grid_map_demos
grid_map_msgs
grid_map_ros
hector_gazebo_plugins
ibeo_lux
image_rotate
imu_processors
imu_transformer
imu_filter_madgwick
spacenav_node
wiimote
respeaker_ros
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
roseus
lgsvl_msgs
explore_lite
multirobot_map_merge
swri_image_util
swri_transform_util
marti_nav_msgs
marti_sensor_msgs
marti_visualization_msgs
mav_msgs
mav_planning_msgs
mavros
mavros_extras
mavros_msgs
test_mavros
mcl_3dl
mir_actions
mir_driver
mir_dwb_critics
mir_msgs
mbf_abstract_core
mbf_abstract_nav
mbf_costmap_core
mbf_costmap_nav
mbf_msgs
mbf_simple_nav
mbf_utility
moveit_commander
moveit_core
moveit_msgs
moveit_python
moveit_visual_tools
mrpt_graphslam_2d
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_slow_and_clear
nav_core
navfn
robot_pose_ekf
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
assisted_teleop
pose_base_controller
sbpl_lattice_planner
twist_recovery
move_base_msgs
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
costmap_cspace_msgs
planner_cspace_msgs
trajectory_tracker_msgs
novatel_msgs
object_recognition_msgs
octomap_msgs
octomap_pa_msgs
osm_cartography
route_network
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
phidgets_ik
pr2_teleop
pr2_teleop_general
pr2_msgs
pr2_arm_move_ik
pr2_common_action_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_arm_kinematics
pr2_hardware_interface
pr2_gazebo
pr2_gazebo_plugins
rc_cloud_accumulator
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
robot_localization
dlux_global_planner
dwb_critics
dwb_local_planner
dwb_msgs
locomotor
nav_2d_msgs
nav_2d_utils
nav_core_adapter
nav_grid_pub_sub
ackermann_steering_controller
force_torque_sensor_controller
turtlesim
roscompile
cl_transforms_stamped
rosserial_windows
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_nav_view
rqt_pose_view
rqt_robot_steering
rtabmap_ros
rviz
rviz_visual_tools
sbg_driver
sick_ldmrs_msgs
stage_ros
static_tf
teb_local_planner
key_teleop
mouse_teleop
teleop_twist_keyboard
tf2_web_republisher
uuv_assistants
uuv_auv_control_allocator
uuv_control_cascaded_pid
uuv_control_msgs
uuv_control_utils
uuv_thruster_manager
uuv_trajectory_control
uuv_gazebo_ros_plugins
uuv_gazebo_ros_plugins_msgs
uuv_sensor_ros_plugins
uuv_sensor_ros_plugins_msgs
uuv_teleop
uuv_world_ros_plugins
uuv_world_ros_plugins_msgs
variant_topic_tools
view_controller_msgs
vision_msgs
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
volksbot_driver
vrpn_client_ros
warehouse_ros
wifi_ddwrt
easy_markers
xpp_msgs
xsens_driver
ypspur_ros
ca_driver
dynpick_driver
innok_heros_driver
katana
nav_pcontroller
rosaria
rtt_geometry_msgs

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn't recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
arbotix_python
aruco_msgs
aruco_ros
asr_msgs
auv_msgs
calibration_msgs
image_cb_detector
interval_intersection
cartesian_msgs
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
control_msgs
costmap_converter
fetch_gazebo
fetch_teleop
gazebo_msgs
gazebo_plugins
gazebo_ros
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_msgs
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
graft
graph_msgs
grid_map_demos
grid_map_msgs
grid_map_ros
haf_grasping
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hector_nav_msgs
image_rotate
imu_processors
imu_transformer
imu_filter_madgwick
spacenav_node
wiimote
respeaker_ros
dynamic_tf_publisher
image_view2
jsk_topic_tools
virtual_force_publisher
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
audio_to_spectrogram
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
roseus
jsk_interactive
jsk_interactive_marker
jsk_rviz_plugins
leap_motion
explore_lite
multirobot_map_merge
marker_msgs
swri_image_util
swri_transform_util
marti_nav_msgs
marti_sensor_msgs
marti_visualization_msgs
mav_msgs
mav_planning_msgs
mavros
mavros_extras
mavros_msgs
test_mavros
md49_base_controller
mongodb_store
moveit_commander
moveit_core
moveit_experimental
moveit_msgs
moveit_python
moveit_visual_tools
mrpt_graphslam_2d
naoqi_bridge_msgs
naoqi_driver
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_slow_and_clear
nav_core
navfn
robot_pose_ekf
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
range_sensor_layer
social_navigation_layers
move_base_msgs
robot_setup_tf_tutorial
nmea_navsat_driver
novatel_msgs
object_recognition_msgs
octomap_msgs
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
dummy_slam_broadcaster
pose_cov_ops
pr2_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
pr2_arm_kinematics
pr2_hardware_interface
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
force_torque_sensor_controller
ros_numpy
turtlesim
cl_transforms_stamped
rospilot
rosserial_windows
rotors_comm
rotors_control
rotors_gazebo
rotors_gazebo_plugins
rotors_hil_interface
rotors_joy_interface
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_nav_view
rqt_pose_view
rqt_robot_steering
rtabmap_ros
hrpsys_ros_bridge
rviz
rviz_visual_tools
laser_ortho_projector
laser_scan_matcher
polar_scan_matcher
sick_ldmrs_msgs
teb_local_planner
key_teleop
mouse_teleop
teleop_twist_joy
teleop_twist_keyboard
tf2_web_republisher
twist_mux
underwater_vehicle_dynamics
uwsim
acc_finder
uos_diffdrive_teleop
uos_freespace
variant_topic_tools
view_controller_msgs
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
osg_utils
rwt_plot
volksbot_driver
vrpn_client_ros
warehouse_ros
easy_markers
xsens_driver
ca_driver
diffdrive_gazebo_plugin
dynpick_driver
ecto_ros
force_torque_sensor_calib
gravity_compensation
frontier_exploration
geonav_transform
grizzly_motion
grizzly_teleop
hector_costmap
hector_elevation_mapping
hector_elevation_msgs
hector_exploration_planner
hector_gps_calibration
hector_quadrotor_controller
hector_quadrotor_gazebo_plugins
hector_quadrotor_model
hector_quadrotor_teleop
hector_barrel_detection_nodelet
hector_rviz_plugins
hector_stair_detection
hector_stair_detection_msgs
hector_worldmodel_msgs
household_objects_database_msgs
humanoid_nav_msgs
innok_heros_driver
katana
manipulation_msgs
nao_interaction_msgs
nao_vision
nao_apps
naoqi_driver_py
naoqi_navigation
naoqi_dcm_driver
nav_pcontroller
netft_utils
pioneer_bringup
pioneer_teleop
rcll_fawkes_sim
rcll_fawkes_sim_msgs
rcll_ros_msgs
robot_pose_publisher
rosaria
rsv_balance_gazebo
rtt_geometry_msgs
stdr_msgs
stdr_robot
stdr_samples
vigir_feet_pose_generator
vigir_foot_pose_transformer
vigir_pattern_generator
vigir_walk_monitor
vigir_footstep_planning_msgs
head_pose_estimation
data_vis_msgs
designator_integration_msgs
iai_control_msgs
iai_kinematics_msgs
iai_pepper_demo_msgs
person_msgs
nao_path_follower
pocketsphinx
rosh_geometry
stereo_slam
vicon_bridge
contact_handler
drawing_handler
force_sensor_handler
quadrotor_handler
rigid_body_handler
ar_track_alvar_msgs
aubo_kinematics
aubo_new_driver
freefloating_gazebo
rail_ceiling
graspdb
rail_grasp_collection
rail_pick_and_place_msgs
rail_recognition
range_msgs
ros_ethernet_rmp
worldlib
stream_manipulator_3d
heatmap
microstrain_mips

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.10
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-05-03
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.11.10 (2018-05-03)

1.11.9 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.11.8 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.11.7 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
arbotix_python
aruco_msgs
aruco_ros
asr_flock_of_birds
asr_flock_of_birds_tracking
asr_mild_base_fake_driving
asr_msgs
asr_navfn
asr_object_database
asr_robot_model_services
ati_force_torque
automotive_navigation_msgs
automotive_navigation_msgs
auv_msgs
axis_camera
brics_actuator
calibration_msgs
image_cb_detector
interval_intersection
capabilities
cartesian_msgs
cartographer_ros
cartographer_ros_msgs
cob_interactive_teleop
cob_script_server
cob_teleop
scenario_test_tools
cob_base_velocity_smoother
cob_cartesian_controller
cob_collision_velocity_filter
cob_control_msgs
cob_footprint_observer
cob_frame_tracker
cob_model_identifier
cob_obstacle_distance
cob_omni_drive_controller
cob_twist_controller
cob_undercarriage_ctrl
cob_grasp_generation
cob_kinematics
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_pick_place_action
cob_linear_nav
cob_map_accessibility_analysis
cob_3d_mapping_msgs
cob_image_flip
cob_object_detection_msgs
cob_perception_msgs
cob_bringup_sim
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
control_msgs
costmap_converter
criutils
dataspeed_ulc_can
eband_local_planner
fawkes_msgs
fetch_gazebo
fetch_auto_dock_msgs
fetch_driver_msgs
fetch_teleop
fiducial_pose
flexbe_states
frame_editor
gazebo_msgs
gazebo_plugins
gazebo_ros
generic_control_toolbox
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_msgs
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
graft
graph_msgs
grid_map_demos
grid_map_msgs
grid_map_ros
haf_grasping
handeye
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hector_nav_msgs
ibeo_lux
image_rotate
imu_processors
imu_transformer
imu_filter_madgwick
spacenav_node
wiimote
respeaker_ros
dynamic_tf_publisher
image_view2
jsk_topic_tools
virtual_force_publisher
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
audio_to_spectrogram
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
roseus
jsk_interactive
jsk_interactive_marker
jsk_rviz_plugins
kobuki_auto_docking
kobuki_keyop
kobuki_node
kobuki_random_walker
kobuki_safety_controller
kobuki_testsuite
kobuki_gazebo_plugins
kobuki_qtestsuite
leap_motion
lgsvl_msgs
marker_msgs
swri_image_util
swri_transform_util
marti_nav_msgs
marti_sensor_msgs
marti_visualization_msgs
mav_msgs
mav_planning_msgs
mavros
mavros_extras
mavros_msgs
test_mavros
mcl_3dl
md49_base_controller
microstrain_mips
mir_actions
mir_driver
mir_dwb_critics
mir_msgs
mongodb_store
moveit_commander
moveit_core
moveit_experimental
moveit_msgs
moveit_python
moveit_visual_tools
mrpt_graphslam_2d
naoqi_bridge_msgs
naoqi_driver
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_base_msgs
move_slow_and_clear
nav_core
navfn
robot_pose_ekf
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
assisted_teleop
pose_base_controller
sbpl_lattice_planner
twist_recovery
range_sensor_layer
social_navigation_layers
robot_setup_tf_tutorial
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
costmap_cspace_msgs
trajectory_tracker_msgs
nmea_navsat_driver
novatel_msgs
object_recognition_msgs
octomap_msgs
octomap_pa
osm_cartography
route_network
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
dummy_slam_broadcaster
phidgets_imu
phidgets_ir
pose_cov_ops
pr2_teleop
pr2_teleop_general
laser_joint_processor
laser_joint_projector
pr2_calibration_launch
pr2_msgs
pr2_arm_move_ik
pr2_common_action_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_arm_kinematics
pr2_hardware_interface
pr2_navigation_perception
pr2_gazebo
pr2_gazebo_plugins
rc_cloud_accumulator
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
ridgeback_gazebo_plugins
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
dlux_global_planner
dwb_critics
dwb_local_planner
dwb_msgs
locomotor
nav_2d_msgs
nav_2d_utils
nav_core_adapter
nav_grid_pub_sub
force_torque_sensor_controller
ros_numpy
turtlesim
rosbridge_library
roscompile
cl_transforms_stamped
rospilot
rosserial_embeddedlinux
rosserial_windows
rotors_comm
rotors_control
rotors_gazebo
rotors_gazebo_plugins
rotors_joy_interface
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_nav_view
rqt_pose_view
rqt_robot_steering
rtabmap_ros
hrpsys_ros_bridge
rviz
rviz_visual_tools
laser_ortho_projector
laser_scan_matcher
polar_scan_matcher
sick_ldmrs_msgs
static_tf
teb_local_planner
key_teleop
mouse_teleop
teleop_twist_joy
teleop_twist_keyboard
tf2_web_republisher
twist_mux
ubiquity_motor
underwater_vehicle_dynamics
uwsim
ur_kinematics
acc_finder
uos_diffdrive_teleop
uos_freespace
variant_topic_tools
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
osg_utils
rwt_plot
volksbot_driver
vrpn_client_ros
warehouse_ros
wifi_ddwrt
easy_markers
xpp_msgs
xsens_driver
ypspur_ros
yocs_ar_marker_tracking
yocs_ar_pair_approach
yocs_ar_pair_tracking
yocs_cmd_vel_mux
yocs_diff_drive_pose_controller
yocs_joyop
yocs_keyop
yocs_localization_manager
yocs_math_toolkit
yocs_safety_controller
yocs_velocity_smoother
yocs_virtual_sensor
yocs_waypoint_provider
yocs_waypoints_navi
agvs_pad
agvs_robot_control
ca_driver
declination
depth_nav_msgs
nav_layer_from_points
diffdrive_gazebo_plugin
dynpick_driver
ecto_ros
force_torque_sensor_calib
gravity_compensation
frontier_exploration
geonav_transform
grizzly_motion
grizzly_teleop
handle_detector
hector_costmap
hector_elevation_mapping
hector_elevation_msgs
hector_exploration_planner
hector_gps_calibration
hector_quadrotor_controller
hector_quadrotor_gazebo_plugins
hector_quadrotor_model
hector_quadrotor_teleop
hector_barrel_detection_nodelet
hector_rviz_plugins
hector_stair_detection
hector_stair_detection_msgs
hector_worldmodel_msgs
household_objects_database_msgs
humanoid_nav_msgs
humanoid_localization
humanoid_planner_2d
imu_compass
industrial_extrinsic_cal
intrinsic_cal
rgbd_depth_correction
target_finder
innok_heros_driver
katana
kobuki_softnode
manipulation_msgs
app1
app2
app3
gazebo_flocking
olfati_saber_flocking
pso
test_statistic
testbb
testnc
testrth
testscdspso
testvstig
hector_uav_msgs
nao_interaction_msgs
nao_vision
nao_apps
naoqi_driver_py
naoqi_navigation
naoqi_dcm_driver
nav_pcontroller
netft_utils
feature_tracker
joint_tracker
omip_common
rb_tracker
shape_reconstruction
shape_tracker
omip_msgs
arm_navigation_msgs
openrave_msgs
openrave_sensors
pheeno_ros
pheeno_ros_sim
pioneer_bringup
pioneer_teleop
rb1_base_localization
rb1_base_pad
rbcar_pad
rbcar_twist2ack
rbcar_joystick
rbcar_robot_control
rcll_fawkes_sim
rcll_fawkes_sim_msgs
rcll_ros_msgs
robot_pose_publisher
robotiq_s_model_articulated_gazebo_plugins
robotnik_msgs
roch_teleop
roch_base
roch_control
roch_safety_controller
rosaria
rosjava_core
rosjava_messages
rrt_exploration
rtt_geometry_msgs
segway_rmp
sophus_ros_conversions
stdr_msgs
stdr_robot
stdr_samples
summit_x_robot_control
summit_xl_localization
summit_xl_pad
summit_xl_robot_control
turtlebot_teleop
turtlebot_actions
turtlebot_calibration
turtlebot_arm_moveit_demos
create_node
create_gazebo_plugins
ur_modern_driver
vigir_feet_pose_generator
vigir_foot_pose_transformer
vigir_pattern_generator
vigir_walk_monitor
vigir_footstep_planning_msgs
waypoint_generator
waypoint_touring
world_canvas_msgs
adhoc_communication
agile_grasp
apriltags_ros
ar_pose
asctec_hl_comm
asctec_hl_interface
ax2550
baxter_core_msgs
baxter_tools
bwi_joystick_teleop
bwi_logging
bwi_msgs
multi_level_map_msgs
multi_level_map_utils
stop_base
calvin_pick_n_place
cob_leg_detection
cob_openni2_tracker
cob_people_detection
cob_people_tracking_filter
crsm_slam
designator_integration_lisp
enu
head_pose_estimation
data_vis_msgs
designator_integration_msgs
iai_control_msgs
iai_kinematics_msgs
iai_pepper_demo_msgs
person_msgs
interaction_cursor_3d
interaction_cursor_demo
interaction_cursor_msgs
interaction_cursor_rviz
nao_jsk_teleop
pr2_base_trajectory_action
jsk_robot_startup
kurt3d
imu_recalibration
kurt_base
moveit_simple_grasps
nao_path_follower
nav2_driver
orientus_driver
pi_tracker
pocketsphinx
program_queue
pr2_precise_trajectory
razer_hydra
rocon_tf_reconstructor
ros_arduino_python
rosh_geometry
hrpsys_gazebo_msgs
segbot_navigation
segbot_sensors
segbot_simulation_apps
skeleton_markers
stereo_slam
uos_rotunit_driver
uos_rotunit_teleop
vicon_bridge
contact_handler
drawing_handler
force_sensor_handler
quadrotor_handler
rigid_body_handler
youbot_driver_ros_interface
ar_track_alvar_msgs
aubo_kinematics
aubo_new_driver
baxter_rpc_msgs
carl_interactive_manipulation
carl_phidgets
carl_tools
carl_demos
carl_moveit
carl_navigation
carl_safety
cirkit_unit03_base
cirkit_unit03_driver
cit_adis_imu
dji_sdk
dji_sdk_dji2mav
evarobot_gazebo
fetch_arm_control
fetch_pbd_interaction
fetch_social_gaze
freefloating_gazebo
fulanghua_ekf_2d
fulanghua_srvs
fulanghua_static_path_publisher
fulanghua_waypoints_nav
gazebo_grasp_plugin
gazebo_state_plugins
gazebo_test_tools
grasp_planning_graspit_msgs
head_action
hexagon_map
hironx_rpc_msgs
homer_mapnav_msgs
homer_nav_libs
husky_base
ihmc_msgs
ihmc_ros_diagnostics
im_msgs
interactive_world_msgs
interactive_world_tools
spatial_world_model
jackal_base
convenience_ros_functions
object_msgs
path_navigation_msgs
sphand_driver
jsk_2015_05_baxter_apc
jsk_apc2016_common
jsk_2013_04_pr2_610
drc_task_common
gazebo_drive_simulator
jsk_maps
jsk_smart_gui
kml_util
lama_interfaces
lama_jockeys
lama_msgs
lj_costmap
nj_costmap
nj_oa_costmap
featurenav_base
lj_laser
lj_laser_heading
nj_laser
nj_oa_laser
place_matcher_fourier
place_matcher_hist
place_matcher_mcc
place_matcher_msgs
crossing_detector
dfs_explorer
goto_crossing
lama_common
local_map
nj_escape_crossing
laser_odometry_core
cv_detection
micros_dynamic_objects_filter
micros_mars_task_alloc
moveit_goal_builder
moveit_controller_multidof
moveit_object_handling
ohm_tsd_slam
pdu_msgs
raptor_dbw_can
raptor_dbw_msgs
pal_control_msgs
pal_detection_msgs
pal_multirobot_msgs
pal_navigation_msgs
pal_simulation_msgs
pal_vision_msgs
pal_visual_localization_msgs
pal_walking_msgs
pal_wifi_localization_msgs
plot_util
pr2_delivery
rail_ceiling
graspdb
rail_grasp_collection
rail_pick_and_place_msgs
rail_recognition
range_msgs
rapid_pbd
rapid_pbd_msgs
rb1_torso_pad
remote_manipulation_markers
remote_monitor
rgbdslam
ridgeback_base
riskrrt
p3dx_dpl
robot_markers
romeo_moveit_actions
ros_ethernet_rmp
schunk_lwa4d
sf30_node
smarthome_light_msgs
smarthome_light_msgs_java
worldlib
spin_hokuyo
robotino_msgs
squirrel_3d_localizer_msgs
squirrel_3d_mapping_msgs
squirrel_footprint_observer_msgs
squirrel_hri_msgs
squirrel_manipulation_msgs
squirrel_navigation_msgs
squirrel_object_perception_msgs
squirrel_person_tracker_msgs
squirrel_view_controller_msgs
squirrel_waypoint_msgs
straf_recovery
stream_manipulator_3d
surface_perception
odom_tf_publish
pure_pursuit_controller
rviz_textured_quads
tensor_field_nav_core
tinkerforge_laser_transform
tork_rpc_util
transform_graph
tum_ardrone
turtlebot_exploration_3d
uga_tum_ardrone
usv_gazebo_plugins
voronoi_planner
wpi_jaco_msgs

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.10.6
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-05-11
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
arbotix_python
aruco_msgs
aruco_ros
axis_camera
calibration_msgs
image_cb_detector
interval_intersection
capabilities
cob_interactive_teleop
cob_script_server
cob_teleop
cob_teleop_cob4
brics_actuator
cob_srvs
cob_base_drive_chain
cob_light
cob_sound
cob_undercarriage_ctrl
cob_grasp_generation
cob_kinematics
cob_lookat_action
cob_moveit_interface
cob_pick_place_action
cob_object_detection_msgs
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
control_msgs
eband_local_planner
gazebo_msgs
gazebo_plugins
gazebo_ros
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2_bullet
tf2_geometry_msgs
tf2_msgs
tf2_ros
turtle_tf
turtle_tf2
graft
graph_msgs
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hector_nav_msgs
image_rotate
imu_pipeline
imu_filter_madgwick
spacenav_node
wiimote
respeaker_ros
dynamic_tf_publisher
image_view2
jsk_topic_tools
virtual_force_publisher
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
audio_to_spectrogram
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
roseus
jsk_interactive
jsk_interactive_marker
jsk_rviz_plugins
kobuki_auto_docking
kobuki_keyop
kobuki_node
kobuki_random_walker
kobuki_safety_controller
kobuki_testsuite
kobuki_gazebo_plugins
kobuki_qtestsuite
mavros
mongodb_store
moveit_msgs
moveit_python
moveit_visual_tools
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_base_msgs
move_slow_and_clear
nav_core
navfn
robot_pose_ekf
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
robot_setup_tf_tutorial
nmea_navsat_driver
novatel_msgs
object_recognition_msgs
octomap_msgs
osm_cartography
route_network
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
dummy_slam_broadcaster
phidgets_imu
phidgets_ir
pr2_teleop
pr2_teleop_general
laser_joint_processor
laser_joint_projector
pr2_calibration_launch
pr2_msgs
pr2_arm_move_ik
pr2_common_action_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_arm_kinematics
pr2_hardware_interface
pr2_navigation_perception
pr2_gazebo
pr2_gazebo_plugins
robot_localization
force_torque_sensor_controller
turtlesim
cl_transforms_stamped
rosserial_arduino
rosserial_embeddedlinux
rosserial_windows
rqt_ez_publisher
rqt_nav_view
rqt_pose_view
rqt_robot_steering
rqt_tf_tree
rtabmap_ros
hrpsys_ros_bridge
rviz
schunk_simulated_tactile_sensors
key_teleop
key_teleop
teleop_twist_keyboard
tf2_web_republisher
twist_mux
ubiquity_motor
ur_kinematics
acc_finder
uos_diffdrive_teleop
uos_freespace
view_controller_msgs
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
osg_utils
rwt_plot
volksbot_driver
wifi_ddwrt
easy_markers
yocs_cmd_vel_mux
yocs_diff_drive_pose_controller
yocs_math_toolkit
yocs_velocity_smoother
yocs_virtual_sensor
yocs_waypoints_navi
declination
diffdrive_gazebo_plugin
dynpick_driver
ecto_ros
force_torque_sensor_calib
gravity_compensation
frontier_exploration
grizzly_motion
grizzly_teleop
handle_detector
hector_costmap
hector_elevation_mapping
hector_elevation_msgs
hector_exploration_planner
hector_quadrotor_controller
hector_quadrotor_gazebo_plugins
hector_quadrotor_model
hector_quadrotor_teleop
hector_barrel_detection_nodelet
hector_rviz_plugins
hector_stair_detection
hector_stair_detection_msgs
hector_worldmodel_msgs
household_objects_database_msgs
humanoid_nav_msgs
humanoid_localization
humanoid_planner_2d
imu_compass
innok_heros_driver
katana
kobuki_softnode
manipulation_msgs
nao_interaction_msgs
nao_vision
nao_apps
naoqi_driver_py
naoqi_navigation
robot_pose_publisher
robotnik_msgs
rosaria
rosjava_messages
rtt_geometry_msgs
segway_rmp
stdr_msgs
stdr_robot
stdr_samples
turtlebot_actions
turtlebot_calibration
turtlebot_panorama
turtlebot_teleop
create_node
create_gazebo_plugins
adhoc_communication
agile_grasp
agvs_pad
planner_msgs
purepursuit_planner
applanix_msgs
apriltags_ros
ar_kinect
ar_pose
asctec_hl_comm
asctec_hl_interface
ax2550
baxter_core_msgs
baxter_tools
calvin_pick_n_place
clearpath_base
cmvision_3d
cob_3d_mapping_msgs
cob_3d_segmentation
cob_leg_detection
cob_openni2_tracker
cob_people_detection
cob_people_tracking_filter
corobot_gazebo
corobot_state_tf
map_to_jpeg
crsm_slam
decision_making_examples
dm_lizi
designator_integration_lisp
enu
epuck_driver
erratic_player
erratic_teleop
ethzasl_icp_mapper
ethzasl_icp_mapper_experiments
ethzasl_point_cloud_vtk_tools
head_pose_estimation
hrl_geom
pykdl_utils
husky_base
husky_teleop
data_vis_msgs
designator_integration_msgs
iai_control_msgs
iai_kinematics_msgs
iai_pepper_demo_msgs
person_msgs
interaction_cursor_3d
interaction_cursor_demo
interaction_cursor_msgs
interaction_cursor_rviz
nao_jsk_teleop
pr2_base_trajectory_action
jsk_robot_startup
kingfisher_teleop
kurt3d
imu_recalibration
kurt_base
moveit_core
moveit_simple_grasps
mr_rqt
mr_tools
nao_path_follower
r2_msgs
gazebo_taskboard
nav2_driver
neato_node
nmea_gps_driver
object_recognition_clusters
openni_tracker
orientus_driver
pal_vision_segmentation
blort
blort_msgs
blort_ros
ndt_mcl
pi_tracker
pocketsphinx
program_queue
pr2_plugs_actions
pr2_plugs_common
pr2_plugs_msgs
stereo_wall_detection
pr2_precise_trajectory
razer_hydra
read_omni_dataset
ros_arduino_python
rosh_geometry
rosruby_tutorials
rosruby_messages
rovio_ctrl
hrpsys_gazebo_msgs
b21_teleop
ptu_control
rflex
segbot_navigation
segbot_concert_services
segbot_simulation_apps
rmp_base
rmp_teleop
sr_gazebo_plugins
skeleton_markers
tedusar_box_detection_msgs
tedusar_cartesian_arm_teleop
open_door_detector
universal_teleop
uos_rotunit_driver
uos_rotunit_teleop
v4r_artoolkitplus
v4r_ellipses
v4r_laser_filter
v4r_laser_robot_calibration
v4r_msgs
vicon_bridge
contact_handler
drawing_handler
force_sensor_handler
quadrotor_handler
rigid_body_handler
wheeled_robin_node
elevator
wheeled_robin_guided_tour
fake_odom
youbot_driver_ros_interface

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn't recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ainstein_radar_msgs
ar_track_alvar
ar_track_alvar_msgs
arbotix_python
aruco_msgs
aruco_ros
asr_direct_search_manager
asr_flock_of_birds
asr_flock_of_birds_tracking
asr_mild_base_fake_driving
asr_msgs
asr_navfn
asr_next_best_view
asr_object_database
asr_recognizer_prediction_ism
asr_recognizer_prediction_psm
asr_robot_model_services
asr_state_machine
ati_force_torque
automotive_navigation_msgs
automotive_navigation_msgs
autoware_msgs
auv_msgs
axis_camera
bagger
bota_driver_testing
rokubimini
rokubimini_msgs
brics_actuator
calibration_msgs
image_cb_detector
interval_intersection
capabilities
carla_msgs
carla_msgs
cartesian_msgs
cartographer_ros
cartographer_ros_msgs
caster_app
cnn_bridge
cob_interactive_teleop
cob_script_server
cob_teleop
scenario_test_tools
cob_actions
cob_srvs
cob_base_controller_utils
cob_base_velocity_smoother
cob_cartesian_controller
cob_collision_velocity_filter
cob_control_msgs
cob_footprint_observer
cob_frame_tracker
cob_mecanum_controller
cob_model_identifier
cob_obstacle_distance
cob_omni_drive_controller
cob_tricycle_controller
cob_twist_controller
cob_undercarriage_ctrl
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_linear_nav
cob_map_accessibility_analysis
cob_3d_mapping_msgs
cob_image_flip
cob_object_detection_msgs
cob_perception_msgs
cob_gazebo_tools
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
computer_status_msgs
control_msgs
costmap_converter
message_relay
crane_x7_examples
criutils
dataspeed_ulc_can
dbw_fca_can
dbw_fca_msgs
dbw_mkz_can
dbw_mkz_msgs
dual_quaternions_ros
dynamixel_workbench_controllers
dynamixel_workbench_operators
eband_local_planner
ensenso_camera
ensenso_camera_msgs
exotica_core_task_maps
exotica_core
exotica_examples
exotica_python
fawkes_msgs
fetch_gazebo
fetch_teleop
fiducial_msgs
flexbe_states
force_torque_sensor
frame_editor
franka_control
franka_example_controllers
fsrobo_r_msgs
gazebo_msgs
gazebo_plugins
gazebo_ros
generic_control_toolbox
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_msgs
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
graph_msgs
grasping_msgs
grid_map_demos
grid_map_msgs
grid_map_ros
haf_grasping
handeye
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hector_nav_msgs
heron_control
heron_controller
heron_gazebo
hfl_driver
husky_base
ibeo_lux
iirob_filters
image_rotate
imu_processors
imu_transformer
imu_filter_madgwick
ixblue_ins_msgs
jointstick
spacenav_node
wiimote
respeaker_ros
dynamic_tf_publisher
image_view2
jsk_topic_tools
virtual_force_publisher
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
audio_to_spectrogram
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
roseus
jsk_interactive
jsk_interactive_marker
jsk_rviz_plugins
kobuki_auto_docking
kobuki_keyop
kobuki_node
kobuki_random_walker
kobuki_safety_controller
kobuki_testsuite
kobuki_gazebo_plugins
kobuki_qtestsuite
kvh_geo_fog_3d_driver
leap_motion
lgsvl_msgs
explore_lite
multirobot_map_merge
multires_image
marker_msgs
swri_image_util
swri_transform_util
marti_nav_msgs
marti_sensor_msgs
marti_visualization_msgs
mav_msgs
mav_planning_msgs
mavros
mavros_extras
mavros_msgs
test_mavros
mcl_3dl
md49_base_controller
microstrain_mips
mir_actions
mir_driver
mir_dwb_critics
mir_msgs
mocap_optitrack
mongodb_store
mbf_abstract_core
mbf_abstract_nav
mbf_costmap_core
mbf_costmap_nav
mbf_msgs
mbf_simple_nav
mbf_utility
move_base_sequence
move_basic
moveit_commander
moveit_core
moveit_msgs
moveit_python
moveit_visual_tools
mrpt_msgs
mrpt_graphslam_2d
multisense_ros
naoqi_bridge_msgs
naoqi_driver
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_slow_and_clear
nav_core
navfn
robot_pose_ekf
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
assisted_teleop
pose_base_controller
sbpl_lattice_planner
twist_recovery
range_sensor_layer
social_navigation_layers
move_base_msgs
robot_setup_tf_tutorial
nearfield_map
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
costmap_cspace_msgs
planner_cspace_msgs
trajectory_tracker_msgs
nmea_navsat_driver
nonpersistent_voxel_layer
novatel_msgs
object_recognition_msgs
octomap_msgs
octomap_pa_msgs
open_manipulator_controller
open_manipulator_msgs
open_manipulator_p_controller
open_manipulator_with_tb3_tools
osm_cartography
route_network
oxford_gps_eth
p2os_driver
p2os_teleop
p2os_urdf
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
dummy_slam_broadcaster
pipeline_planner
pose_cov_ops
pr2_teleop
pr2_teleop_general
laser_joint_processor
laser_joint_projector
pr2_calibration_launch
pr2_msgs
pr2_arm_move_ik
pr2_common_action_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_arm_kinematics
pr2_hardware_interface
pr2_navigation_perception
pr2_gazebo
pr2_gazebo_plugins
py_trees_ros
qb_chain_controllers
radar_pa
rail_manipulation_msgs
pdu_msgs
raptor_dbw_can
raptor_dbw_msgs
raspimouse_fake
rc_cloud_accumulator
rc_genicam_driver
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
ridgeback_gazebo_plugins
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
dlux_global_planner
dwb_critics
dwb_local_planner
dwb_msgs
locomotor
nav_2d_msgs
nav_2d_utils
nav_core_adapter
nav_grid_pub_sub
robot_nav_rviz_plugins
robot_nav_viz_demos
rsm_additions
rsm_core
rsm_msgs
ackermann_steering_controller
force_torque_sensor_controller
ros_numpy
turtlesim
roscompile
cl_transforms_stamped
rospilot
rosserial_windows
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_nav_view
rqt_pose_view
rqt_py_trees
rqt_robot_steering
rr_openrover_driver
rr_rover_zero_driver
rtabmap_ros
hrpsys_ros_bridge
rviz
rviz_visual_tools
sbg_driver
laser_ortho_projector
laser_scan_matcher
polar_scan_matcher
sciurus17_examples
sciurus17_msgs
sciurus17_vision
seed_r7_gazebo
seed_r7_ros_controller
sick_ldmrs_msgs
simple_grasping
spatio_temporal_voxel_layer
sr_robot_msgs
hand_kinematics
sr_grasp_fast_planner
stag_ros
stage_ros
static_tf
teb_local_planner
teleop_legged_robots
key_teleop
mouse_teleop
teleop_twist_joy
teleop_twist_keyboard
teleop_twist_keyboard_cpp
teraranger_array
tf2_web_republisher
turtlebot3_example
turtlebot3_teleop
turtlebot3_automatic_parking
turtlebot3_automatic_parking_vision
turtlebot3_follower
turtlebot3_panorama
turtlebot3_autorace_control
turtlebot3_autorace_detect
turtlebot3_fake
turtlebot3_gazebo
tuw_airskin_msgs
tuw_gazebo_msgs
tuw_geometry_msgs
tuw_multi_robot_msgs
tuw_nav_msgs
tuw_object_msgs
tuw_vehicle_msgs
tuw_multi_robot_ctrl
tuw_multi_robot_local_behavior_controller
tuw_multi_robot_router
tuw_voronoi_graph
tuw_geometry_rviz
twist_mux
ubiquity_motor
underwater_vehicle_dynamics
uwsim
ur_kinematics
acc_finder
uos_diffdrive_teleop
uos_freespace
uuv_assistants
uuv_auv_control_allocator
uuv_control_cascaded_pid
uuv_control_msgs
uuv_control_utils
uuv_thruster_manager
uuv_trajectory_control
uuv_gazebo_ros_plugins
uuv_gazebo_ros_plugins_msgs
uuv_sensor_ros_plugins
uuv_sensor_ros_plugins_msgs
uuv_teleop
uuv_world_ros_plugins
uuv_world_ros_plugins_msgs
variant_topic_tools
vesc_ackermann
view_controller_msgs
vision_msgs
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
osg_utils
volksbot_driver
volta_teleoperator
vrpn_client_ros
vtec_msgs
warehouse_ros
wifi_ddwrt
easy_markers
xpp_msgs
xsens_driver
yocs_msgs
ypspur_ros
yocs_ar_marker_tracking
yocs_ar_pair_approach
yocs_ar_pair_tracking
yocs_cmd_vel_mux
yocs_diff_drive_pose_controller
yocs_joyop
yocs_keyop
yocs_localization_manager
yocs_math_toolkit
yocs_safety_controller
yocs_velocity_smoother
yocs_virtual_sensor
yocs_waypoint_provider
yocs_waypoints_navi
agvs_pad
agvs_robot_control
apriltag_ros
auction_msgs
auction_srvs
bhand_controller
bin_pose_msgs
carla_ros_bridge
choreo_geometry_conversion_helpers
choreo_msgs
choreo_output_processor
choreo_task_sequence_planner
choreo_task_sequence_processor
choreo_visual_tools
cog_publisher
cpswarm_msgs
ca_driver
darknet_ros_msgs
declination
depth_nav_msgs
nav_layer_from_points
diffdrive_gazebo_plugin
dynpick_driver
piksi_multi_rtk
piksi_rtk_msgs
ecto_ros
fanuc_grinding_path_planning
fanuc_grinding_post_processor
find_moving_objects
follow_waypoints
force_torque_sensor_calib
gravity_compensation
frontier_exploration
geonav_transform
gps_goal
handle_detector
hector_costmap
hector_elevation_mapping
hector_elevation_msgs
hector_exploration_planner
hector_gps_calibration
hector_quadrotor_actions
hector_quadrotor_controllers
hector_quadrotor_gazebo_plugins
hector_quadrotor_interface
hector_quadrotor_model
hector_quadrotor_teleop
hector_uav_msgs
hector_uav_msgs
hector_barrel_detection_nodelet
hector_rviz_plugins
hector_stair_detection
hector_stair_detection_msgs
hector_worldmodel_msgs
household_objects_database_msgs
humanoid_nav_msgs
footstep_planner
humanoid_localization
humanoid_planner_2d
ifm_o3mxxx
iiwa_msgs
imu_compass
indoor_localization
industrial_extrinsic_cal
intrinsic_cal
rgbd_depth_correction
target_finder
innok_heros_driver
rqt_ground_robot_teleop
jog_arm
jog_msgs
jog_msgs
katana
kobuki_softnode
mynt_eye_ros_wrapper
look_at_pose
lost_comms_recovery
manipulation_msgs
manipulator_h_base_module
manipulator_h_base_module_msgs
app1
app2
app3
gazebo_flocking
olfati_saber_flocking
pso
test_statistic
testbb
testnc
testrth
testscdspso
testvstig
mitre_fast_layered_map
mobility_base_examples
mobility_base_gazebo_plugins
move_base_to_manip
mrpt_bridge
multipoint_navigation_receiver
multiwii
nao_interaction_msgs
nao_vision
nao_apps
naoqi_driver_py
naoqi_navigation
naoqi_dcm_driver
nav_pcontroller
netft_utils
feature_tracker
joint_tracker
omip_common
rb_tracker
omip_msgs
arm_navigation_msgs
openrave_msgs
openrave_sensors
orb_slam2_with_maps-odom
pattern_manager
pheeno_ros
pheeno_ros_sim
pioneer_bringup
pioneer_mrs
pioneer_teleop
rb1_base_localization
rb1_base_pad
rbcar_pad
rbcar_joystick
rbcar_robot_control
rcll_fawkes_sim
rcll_fawkes_sim_msgs
rcll_ros_msgs
robot_pose_publisher
robotiq_3f_gripper_articulated_gazebo_plugins
op3_base_module
op3_localization
op3_online_walking_module
op3_ball_detector
op3_demo
op3_online_walking_module_msgs
op3_gui_demo
roch_teleop
roch_base
roch_control
roch_safety_controller
rodi_robot
rosaria
rosjava_core
rosjava_messages
rrt_exploration
rsv_balance_gazebo
rtt_geometry_msgs
segway_rmp
simple_drive
slam_constructor
smacha_ros
smp_ros
sophus_ros_conversions
stdr_msgs
stdr_robot
stdr_samples
stomp_moveit
summit_x_robot_control
summit_xl_localization
summit_xl_pad
svenzva_drivers
svenzva_joy
swarm_behaviors_position
swarm_behaviors_velocity
uav_optimal_coverage
area_division
coverage_path
kinematics_exchanger
target_monitor
tb3_monitor
tb3_safe_teleop
tello_driver
ati_ft_sensor
thormang3_base_module
thormang3_manipulation_module
thormang3_walking_module
thormang3_imu_3dm_gx4
thormang3_feet_ft_module_msgs
thormang3_manipulation_module_msgs
thormang3_walking_module_msgs
thormang3_demo
thormang3_foot_step_generator
turtlebot_teleop
turtlebot_actions
turtlebot_calibration
turtlebot_arm_moveit_demos
turtlebot_arm_object_manipulation
create_node
create_gazebo_plugins
tuw_marker_slam
twistimu
ur_modern_driver
uuv_cpc_sensor
uuv_plume_msgs
uuv_plume_simulator
vigir_feet_pose_generator
vigir_foot_pose_transformer
vigir_pattern_generator
vigir_walk_monitor
vigir_footstep_planning_msgs
watson_ins
waypoint_generator
waypoint_touring
wire_viz
world_canvas_msgs
xarm_api
xarm_moveit_servo
xarm_planner
xbot_bringup
xbot_node
xbot_safety_controller
xiaoqiang_driver

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package geometry_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn't recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they've been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it's deprecated.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector 'using' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to 'data' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn't stand on it's own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ainstein_radar_msgs
amr_interop_bridge
amr_interop_msgs
apriltag_ros
ar_track_alvar
ar_track_alvar_msgs
arbotix_python
aruco_msgs
aruco_ros
asr_direct_search_manager
asr_flock_of_birds
asr_flock_of_birds_tracking
asr_mild_base_fake_driving
asr_msgs
asr_navfn
asr_next_best_view
asr_object_database
asr_recognizer_prediction_ism
asr_recognizer_prediction_psm
asr_robot_model_services
asr_state_machine
dock
perch
ff_msgs
handrail_detect
marker_tracking
vive_localization
framestore
msg_conversions
derived_object_msgs
radar_msgs
ati_force_torque
automotive_navigation_msgs
autoware_msgs
auv_msgs
axis_camera
bagger
bota_driver_testing
rokubimini
rokubimini_msgs
brics_actuator
calibration_msgs
image_cb_detector
interval_intersection
capabilities
carla_msgs
cartesian_control_msgs
cartesian_msgs
cartographer_ros
cartographer_ros_msgs
caster_app
aruco_pose
clover
cnn_bridge
cob_interactive_teleop
cob_script_server
cob_teleop
scenario_test_tools
cob_actions
cob_srvs
cob_base_controller_utils
cob_base_velocity_smoother
cob_cartesian_controller
cob_collision_velocity_filter
cob_control_msgs
cob_footprint_observer
cob_frame_tracker
cob_mecanum_controller
cob_model_identifier
cob_obstacle_distance
cob_omni_drive_controller
cob_tricycle_controller
cob_twist_controller
cob_undercarriage_ctrl
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_linear_nav
cob_map_accessibility_analysis
cob_3d_mapping_msgs
cob_image_flip
cob_object_detection_msgs
cob_perception_msgs
cob_gazebo_tools
common_msgs
nav_msgs
sensor_msgs
shape_msgs
trajectory_msgs
visualization_msgs
turtle_actionlib
computer_status_msgs
control_msgs
copernicus_teleoperator
costmap_converter
message_relay
crane_x7_examples
cras_imu_tools
cras_cpp_common
cras_py_common
cras_topic_tools
tf_static_publisher
create_driver
criutils
dataspeed_ulc_can
dbw_fca_can
dbw_fca_msgs
dbw_mkz_can
dbw_mkz_msgs
dbw_polaris_can
dbw_polaris_msgs
dual_quaternions_ros
dynamixel_workbench_controllers
dynamixel_workbench_operators
eband_local_planner
ensenso_camera
ensenso_camera_msgs
er_public_msgs
ess_imu_ros1_uart_driver
exotica_core_task_maps
exotica_core
exotica_examples
exotica_python
gazesense_bridge
gazesense_msgs
fawkes_msgs
fetch_auto_dock_msgs
fetch_driver_msgs
fetch_open_auto_dock
fetch_depth_layer
fetch_teleop
fetch_simple_linear_controller
fiducial_msgs
find_object_2d
flexbe_states
floam
force_torque_sensor
foxglove_msgs
frame_editor
franka_control
franka_example_controllers
franka_gazebo
fsrobo_r_msgs
fuse_constraints
fuse_core
fuse_models
fuse_optimizers
fuse_publishers
fuse_viz
gazebo_msgs
gazebo_plugins
gazebo_ros
generic_control_toolbox
geodesy
geographic_msgs
eigen_conversions
kdl_conversions
tf
tf_conversions
tf2
tf2
tf2_bullet
tf2_bullet
tf2_eigen
tf2_eigen
tf2_geometry_msgs
tf2_geometry_msgs
tf2_msgs
tf2_msgs
tf2_ros
tf2_ros
tf2_sensor_msgs
tf2_sensor_msgs
turtle_tf
turtle_tf2
graceful_controller_ros
graft
graph_msgs
grasping_msgs
grid_map_demos
grid_map_msgs
grid_map_ros
haf_grasping
handeye
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_imu_tools
hector_nav_msgs
heifu_msgs
heifu_safety
heron_control
heron_controller
heron_gazebo
hfl_driver
husky_base
ibeo_lux
iirob_filters
image_rotate
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
inertial_sense_ros
inno_sim_interface
innopolis_vtol_dynamics
iris_lama_ros
ixblue_ins_msgs
jointstick
spacenav_node
wiimote
respeaker_ros
dynamic_tf_publisher
image_view2
jsk_topic_tools
virtual_force_publisher
jsk_footstep_msgs
jsk_gui_msgs
posedetection_msgs
cmd_vel_smoother
jsk_footstep_controller
jsk_footstep_planner
audio_to_spectrogram
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_perception
jsk_recognition_msgs
jsk_recognition_utils
roseus
jsk_interactive
jsk_interactive_marker
jsk_rviz_plugins
kobuki_auto_docking
kobuki_keyop
kobuki_node
kobuki_random_walker
kobuki_safety_controller
kobuki_testsuite
kobuki_gazebo_plugins
kobuki_qtestsuite
kvh_geo_fog_3d_driver
leap_motion
leo_bringup
leo_gazebo
lgsvl_msgs
hri
lsm_localization
explore_lite
multirobot_map_merge
multires_image
marker_msgs
swri_image_util
swri_transform_util
marti_nav_msgs
marti_sensor_msgs
marti_visualization_msgs
mav_msgs
mav_planning_msgs
mav_teleop_twist_keyboard
mavros
mavros_extras
mavros_msgs
test_mavros
mcl_3dl
md49_base_controller
microstrain_inertial_driver
microstrain_inertial_msgs
microstrain_inertial_rqt
microstrain_mips
mir_actions
mir_driver
mir_dwb_critics
mir_msgs
mobile_robot_simulator
mocap_nokov
mocap_optitrack
mongodb_store
mbf_abstract_core
mbf_abstract_nav
mbf_costmap_core
mbf_costmap_nav
mbf_msgs
mbf_simple_nav
mbf_utility
move_base_sequence
move_base_swp
move_basic
moveit_commander
moveit_core
moveit_servo
moveit_ros_planning_interface
moveit_msgs
moveit_python
moveit_visual_tools
mpc_local_planner
mrpt_msgs
mrpt_msgs_bridge
mrpt_reactivenav2d
mrpt_sensorlib
multisense_ros
naoqi_bridge_msgs
naoqi_driver
amcl
base_local_planner
costmap_2d
fake_localization
global_planner
move_base
move_slow_and_clear
nav_core
navfn
rotate_recovery
nav2d_exploration
nav2d_karto
nav2d_localizer
nav2d_msgs
nav2d_navigator
assisted_teleop
pose_base_controller
sbpl_lattice_planner
twist_recovery
range_sensor_layer
social_navigation_layers
move_base_msgs
robot_setup_tf_tutorial
nearfield_map
costmap_cspace
joystick_interrupt
map_organizer
obj_to_pointcloud
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
costmap_cspace_msgs
planner_cspace_msgs
trajectory_tracker_msgs
nmea_navsat_driver
nonpersistent_voxel_layer
novatel_msgs
object_recognition_msgs
octomap_msgs
octomap_pa_msgs
omnibase_control
omnibase_description
omnibase_gazebo
open_manipulator_controller
open_manipulator_msgs
open_manipulator_p_controller
open_manipulator_with_tb3_tools
osm_cartography
route_network
ov_eval
ov_msckf
outsight_alb_driver
oxford_gps_eth
p2os_driver
p2os_teleop
p2os_urdf
face_detector
leg_detector
people_msgs
people_tracking_filter
people_velocity_tracker
dummy_slam_broadcaster
pcl_ros
pilz_store_positions
pilz_control
pipeline_planner
pose_cov_ops
pouco2000_ros_gazebo
pr2_teleop
pr2_teleop_general
laser_joint_processor
laser_joint_projector
pr2_calibration_launch
pr2_msgs
pr2_arm_move_ik
pr2_common_action_msgs
pr2_controllers_msgs
pr2_head_action
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_arm_kinematics
pr2_hardware_interface
pr2_navigation_perception
pr2_gazebo
pr2_gazebo_plugins
psen_scan_v2
py_trees_ros
qb_chain_controllers
qb_chain_msgs
radar_pa
rail_manipulation_msgs
rail_mesh_icp
pdu_msgs
raptor_dbw_can
raptor_dbw_msgs
raspimouse_fake
rc_cloud_accumulator
rc_genicam_driver
rc_reason_msgs
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
rc_visard_driver
ridgeback_gazebo_plugins
robot_body_filter
robot_calibration
robot_calibration_msgs
robot_controllers
robot_localization
dlux_global_planner
dwb_critics
dwb_local_planner
dwb_msgs
locomotor
nav_2d_msgs
nav_2d_utils
nav_core_adapter
nav_grid_pub_sub
robot_nav_rviz_plugins
robot_nav_viz_demos
rqt_dwb_plugin
robot_one
robot_pose_ekf
rsm_additions
rsm_core
rsm_msgs
ros_babel_fish
ros_babel_fish_test_msgs
ackermann_steering_controller
force_torque_sensor_controller
cartesian_interface
twist_controller
inorbit_republisher
ros_numpy
ros_robodk_post_processors
turtlesim
rosbridge_library
roscompile
rosee_msg
cl_transforms_stamped
rosmsg_cpp
rospilot
rosserial_windows
rotors_comm
rotors_control
rotors_gazebo
rotors_gazebo_plugins
rotors_joy_interface
rqt_bag_plugins
rqt_ez_publisher
rqt_image_view
rqt_nav_view
rqt_pose_view
rqt_py_trees
rqt_robot_steering
rr_openrover_driver
rr_rover_zero_driver
rtabmap_ros
hrpsys_ros_bridge
rviz
rviz_animated_view_controller
rviz_visual_tools
sbg_driver
laser_ortho_projector
laser_scan_matcher
polar_scan_matcher
sciurus17_examples
sciurus17_msgs
sciurus17_vision
seed_r7_gazebo
seed_r7_ros_controller
septentrio_gnss_driver
sick_ldmrs_msgs
simple_grasping
slam_toolbox_msgs
backward_global_planner
backward_local_planner
forward_global_planner
forward_local_planner
pure_spinning_local_planner
undo_path_global_planner
snowbot_operating_system
spatio_temporal_voxel_layer
sr_robot_msgs
sr_error_reporter
hand_kinematics
sr_grasp_fast_planner
stag_ros
stage_ros
static_tf
steering_functions
swarm_ros_bridge
teb_local_planner
teleop_legged_robots
key_teleop
mouse_teleop
teleop_twist_joy
teleop_twist_keyboard
teleop_twist_keyboard_cpp
teraranger_array
tf2_server
tf2_urdf
tf2_web_republisher
turtle_teleop_multi_key
turtlebot3_example
turtlebot3_teleop
turtlebot3_automatic_parking
turtlebot3_automatic_parking_vision
turtlebot3_follower
turtlebot3_panorama
turtlebot3_autorace_control
turtlebot3_autorace_detect
turtlebot3_fake
turtlebot3_gazebo
tuw_airskin_msgs
tuw_gazebo_msgs
tuw_geometry_msgs
tuw_local_controller_msgs
tuw_multi_robot_msgs
tuw_nav_msgs
tuw_object_msgs
tuw_vehicle_msgs
tuw_multi_robot_ctrl
tuw_multi_robot_local_behavior_controller
tuw_multi_robot_router
tuw_voronoi_graph
tuw_geometry_rviz
twist_mux
uavcan_communicator
ubiquity_motor
underwater_vehicle_dynamics
uwsim
ur_kinematics
uos_diffdrive_teleop
uos_freespace
ur_msgs
ur_robot_driver
uuv_assistants
uuv_auv_control_allocator
uuv_control_cascaded_pid
uuv_control_msgs
uuv_control_utils
uuv_thruster_manager
uuv_trajectory_control
uuv_gazebo_ros_plugins
uuv_gazebo_ros_plugins_msgs
uuv_sensor_ros_plugins
uuv_sensor_ros_plugins_msgs
uuv_teleop
uuv_world_ros_plugins
uuv_world_ros_plugins_msgs
variant_topic_tools
vesc_ackermann
view_controller_msgs
vision_msgs
visp_auto_tracker
visp_bridge
visp_camera_calibration
visp_hand2eye_calibration
visp_tracker
visp_ros
osg_utils
rwt_nav
rwt_plot
volksbot_driver
volta_teleoperator
vrpn_client_ros
vtec_msgs
warehouse_ros
wifi_ddwrt
witmotion_ros
easy_markers
xpp_msgs
xsens_driver
yocs_msgs
ypspur_ros
yocs_ar_marker_tracking
yocs_ar_pair_approach
yocs_ar_pair_tracking
yocs_cmd_vel_mux
yocs_diff_drive_pose_controller
yocs_joyop
yocs_keyop
yocs_localization_manager
yocs_math_toolkit
yocs_safety_controller
yocs_velocity_smoother
yocs_virtual_sensor
yocs_waypoint_provider
yocs_waypoints_navi
z_laser_gui
z_laser_msgs
z_laser_viz

Recent questions tagged geometry_msgs at Robotics Stack Exchange